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 | |
joint_limits | |
Functions | |
bool | joint_limits::declare_parameters (const std::string &joint_name, const rclcpp::Node::SharedPtr &node, const std::string ¶m_ns) |
bool | joint_limits::get_joint_limits (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. More... | |
bool | joint_limits::get_joint_limits (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. More... | |