moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Classes | |
class | TrajectoryCache |
Trajectory Cache manager for MoveIt. More... | |
Functions | |
std::string | getWorkspaceFrameId (const moveit::planning_interface::MoveGroupInterface &move_group, const moveit_msgs::msg::WorkspaceParameters &workspace_parameters) |
std::string | getCartesianPathRequestFrameId (const moveit::planning_interface::MoveGroupInterface &move_group, const moveit_msgs::srv::GetCartesianPath::Request &path_request) |
void | queryAppendRangeInclusiveWithTolerance (Query &query, const std::string &name, double center, double tolerance) |
void | sortConstraints (std::vector< moveit_msgs::msg::JointConstraint > &joint_constraints, std::vector< moveit_msgs::msg::PositionConstraint > &position_constraints, std::vector< moveit_msgs::msg::OrientationConstraint > &orientation_constraints) |
std::string moveit_ros::trajectory_cache::getCartesianPathRequestFrameId | ( | const moveit::planning_interface::MoveGroupInterface & | move_group, |
const moveit_msgs::srv::GetCartesianPath::Request & | path_request | ||
) |
std::string moveit_ros::trajectory_cache::getWorkspaceFrameId | ( | const moveit::planning_interface::MoveGroupInterface & | move_group, |
const moveit_msgs::msg::WorkspaceParameters & | workspace_parameters | ||
) |
void moveit_ros::trajectory_cache::queryAppendRangeInclusiveWithTolerance | ( | Query & | query, |
const std::string & | name, | ||
double | center, | ||
double | tolerance | ||
) |
Definition at line 79 of file trajectory_cache.cpp.
void moveit_ros::trajectory_cache::sortConstraints | ( | std::vector< moveit_msgs::msg::JointConstraint > & | joint_constraints, |
std::vector< moveit_msgs::msg::PositionConstraint > & | position_constraints, | ||
std::vector< moveit_msgs::msg::OrientationConstraint > & | orientation_constraints | ||
) |
Definition at line 85 of file trajectory_cache.cpp.