moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Functions
pilz_industrial_motion_planner::joint_limits_interface Namespace Reference

Classes

struct  JointLimits
 Extends joint_limits_interface::JointLimits with a deceleration parameter. More...
 

Functions

bool declareParameters (const std::string &joint_name, const std::string &param_ns, const rclcpp::Node::SharedPtr &node)
 
bool getJointLimits (const std::string &joint_name, const std::string &param_ns, const rclcpp::Node::SharedPtr &node, joint_limits_interface::JointLimits &limits)
 

Function Documentation

◆ declareParameters()

bool pilz_industrial_motion_planner::joint_limits_interface::declareParameters ( const std::string &  joint_name,
const std::string &  param_ns,
const rclcpp::Node::SharedPtr &  node 
)
inline
See also
joint_limits::declare_parameters(...)

Definition at line 49 of file joint_limits_interface_extension.h.

Here is the call graph for this function:
Here is the caller graph for this function:

◆ getJointLimits()

bool pilz_industrial_motion_planner::joint_limits_interface::getJointLimits ( const std::string &  joint_name,
const std::string &  param_ns,
const rclcpp::Node::SharedPtr &  node,
joint_limits_interface::JointLimits limits 
)
inline
See also
joint_limits::get_joint_limits(...)

Definition at line 57 of file joint_limits_interface_extension.h.

Here is the call graph for this function:
Here is the caller graph for this function: