|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
The representation of a motion plan (as ROS messages) More...
#include <move_group_interface.hpp>
Public Attributes | |
| moveit_msgs::msg::RobotState | start_state |
| The full starting state used for planning. | |
| moveit_msgs::msg::RobotTrajectory | trajectory |
| The trajectory of the robot (may not contain joints that are the same as for the start_state_) | |
| double | planning_time |
| The amount of time it took to generate the plan. | |
The representation of a motion plan (as ROS messages)
Definition at line 107 of file move_group_interface.hpp.
| double moveit::planning_interface::MoveGroupInterface::Plan::planning_time |
The amount of time it took to generate the plan.
Definition at line 116 of file move_group_interface.hpp.
| moveit_msgs::msg::RobotState moveit::planning_interface::MoveGroupInterface::Plan::start_state |
The full starting state used for planning.
Definition at line 110 of file move_group_interface.hpp.
| moveit_msgs::msg::RobotTrajectory moveit::planning_interface::MoveGroupInterface::Plan::trajectory |
The trajectory of the robot (may not contain joints that are the same as for the start_state_)
Definition at line 113 of file move_group_interface.hpp.