|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <limits>#include <string>#include <joint_limits_copy/joint_limits.hpp>#include <rclcpp/rclcpp.hpp>

Go to the source code of this file.
Namespaces | |
| namespace | joint_limits |
Functions | |
| bool | joint_limits::declareParameters (const std::string &joint_name, const rclcpp::Node::SharedPtr &node, const std::string ¶m_ns) |
| bool | joint_limits::getJointLimits (const std::string &joint_name, const rclcpp::Node::SharedPtr &node, const std::string ¶m_ns, JointLimits &limits) |
| Populate a JointLimits instance from the ROS parameter server. | |
| bool | joint_limits::getJointLimits (const std::string &joint_name, const rclcpp::Node::SharedPtr &node, const std::string ¶m_ns, SoftJointLimits &soft_limits) |
| Populate a SoftJointLimits instance from the ROS parameter server. | |