moveit2
The MoveIt Motion Planning Framework for ROS 2.
Namespaces | Functions
joint_limits_rosparam.hpp File Reference
#include <limits>
#include <string>
#include <joint_limits_copy/joint_limits.hpp>
#include <rclcpp/rclcpp.hpp>
Include dependency graph for joint_limits_rosparam.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 joint_limits
 

Functions

bool joint_limits::declareParameters (const std::string &joint_name, const rclcpp::Node::SharedPtr &node, const std::string &param_ns)
 
bool joint_limits::getJointLimits (const std::string &joint_name, const rclcpp::Node::SharedPtr &node, const std::string &param_ns, JointLimits &limits)
 Populate a JointLimits instance from the ROS parameter server. More...
 
bool joint_limits::getJointLimits (const std::string &joint_name, const rclcpp::Node::SharedPtr &node, const std::string &param_ns, SoftJointLimits &soft_limits)
 Populate a SoftJointLimits instance from the ROS parameter server. More...