moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
This class orchestrates the planning of single commands and command lists. More...
#include <command_list_manager.h>
Public Member Functions | |
CommandListManager (const rclcpp::Node::SharedPtr &node, const moveit::core::RobotModelConstPtr &model) | |
RobotTrajCont | solve (const planning_scene::PlanningSceneConstPtr &planning_scene, const planning_pipeline::PlanningPipelinePtr &planning_pipeline, const moveit_msgs::msg::MotionSequenceRequest &req_list) |
Generates trajectories for the specified list of motion commands. | |
This class orchestrates the planning of single commands and command lists.
Definition at line 71 of file command_list_manager.h.
pilz_industrial_motion_planner::CommandListManager::CommandListManager | ( | const rclcpp::Node::SharedPtr & | node, |
const moveit::core::RobotModelConstPtr & | model | ||
) |
RobotTrajCont pilz_industrial_motion_planner::CommandListManager::solve | ( | const planning_scene::PlanningSceneConstPtr & | planning_scene, |
const planning_pipeline::PlanningPipelinePtr & | planning_pipeline, | ||
const moveit_msgs::msg::MotionSequenceRequest & | req_list | ||
) |
Generates trajectories for the specified list of motion commands.
The following rules apply:
planning_scene | The planning scene to be used for trajectory generation. |
req_list | List of motion requests containing: PTP, LIN, CIRC and/or gripper commands. Please note: A request is only valid if:
|
Please note: Starts states do not need to state the joints of all groups. It is sufficient if a start state states only the joints of the group which it belongs to. Starts states can even be incomplete. In this case default values are set for the unset joints.
Definition at line 87 of file command_list_manager.cpp.