moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
A generic representation on what a computed motion plan looks like. More...
#include <plan_representation.h>
Public Attributes | |
planning_scene_monitor::PlanningSceneMonitorPtr | planning_scene_monitor |
planning_scene::PlanningSceneConstPtr | planning_scene |
std::vector< ExecutableTrajectory > | plan_components |
robot_trajectory::RobotTrajectoryPtr | executed_trajectory |
The trace of the trajectory recorded during execution. | |
moveit_msgs::msg::MoveItErrorCodes | error_code |
An error code reflecting what went wrong (if anything) | |
A generic representation on what a computed motion plan looks like.
Definition at line 73 of file plan_representation.h.
moveit_msgs::msg::MoveItErrorCodes plan_execution::ExecutableMotionPlan::error_code |
An error code reflecting what went wrong (if anything)
Definition at line 84 of file plan_representation.h.
robot_trajectory::RobotTrajectoryPtr plan_execution::ExecutableMotionPlan::executed_trajectory |
The trace of the trajectory recorded during execution.
Definition at line 81 of file plan_representation.h.
std::vector<ExecutableTrajectory> plan_execution::ExecutableMotionPlan::plan_components |
Definition at line 78 of file plan_representation.h.
planning_scene::PlanningSceneConstPtr plan_execution::ExecutableMotionPlan::planning_scene |
Definition at line 76 of file plan_representation.h.
planning_scene_monitor::PlanningSceneMonitorPtr plan_execution::ExecutableMotionPlan::planning_scene_monitor |
Definition at line 75 of file plan_representation.h.