|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
moveit_msgs::srv::GetCartesianPath::Request features to key the trajectory cache on. More...
#include <warehouse_ros/message_collection.h>#include <moveit/move_group_interface/move_group_interface.hpp>#include <moveit_msgs/srv/get_cartesian_path.hpp>#include <moveit/trajectory_cache/features/features_interface.hpp>

Go to the source code of this file.
Classes | |
| class | moveit_ros::trajectory_cache::CartesianWorkspaceFeatures |
| Extracts group name and frame ID from the plan request. More... | |
| class | moveit_ros::trajectory_cache::CartesianStartStateJointStateFeatures |
Extracts details of the joint state from the start_state field in the plan request. More... | |
| class | moveit_ros::trajectory_cache::CartesianMaxSpeedAndAccelerationFeatures |
| Extracts max velocity and acceleration scaling, and cartesian speed limits from the plan request. More... | |
| class | moveit_ros::trajectory_cache::CartesianMaxStepAndJumpThresholdFeatures |
| Extracts max step and jump thresholds from the plan request. More... | |
| class | moveit_ros::trajectory_cache::CartesianWaypointsFeatures |
Extracts features from the waypoints and link_name field in the plan request. More... | |
| class | moveit_ros::trajectory_cache::CartesianPathConstraintsFeatures |
Extracts features from the path_constraints field in the plan request. More... | |
Namespaces | |
| namespace | moveit_ros |
| namespace | moveit_ros::trajectory_cache |
moveit_msgs::srv::GetCartesianPath::Request features to key the trajectory cache on.
Definition in file get_cartesian_path_request_features.hpp.