The representation of a motion plan (as ROS messasges) More...
#include <move_group.h>
Public Attributes | |
moveit_msgs::RobotState | start_state_ |
The full starting state used for planning. | |
moveit_msgs::RobotTrajectory | trajectory_ |
The trajectory of the robot (may not contain joints that are the same as for the start_state_) |
The representation of a motion plan (as ROS messasges)
Definition at line 87 of file move_group.h.
moveit_msgs::RobotState moveit::planning_interface::MoveGroup::Plan::start_state_ |
The full starting state used for planning.
Definition at line 90 of file move_group.h.
moveit_msgs::RobotTrajectory moveit::planning_interface::MoveGroup::Plan::trajectory_ |
The trajectory of the robot (may not contain joints that are the same as for the start_state_)
Definition at line 93 of file move_group.h.