moveit_msgs/MoveGroup Action

File: moveit_msgs/MoveGroup.action

Action Definition

# Motion planning request to pass to planner
MotionPlanRequest request

# Planning options
PlanningOptions planning_options

---

# An error code reflecting what went wrong
MoveItErrorCodes error_code

# The full starting state of the robot at the start of the trajectory
moveit_msgs/RobotState trajectory_start

# The trajectory that moved group produced for execution
moveit_msgs/RobotTrajectory planned_trajectory

# The trace of the trajectory recorded during execution
moveit_msgs/RobotTrajectory executed_trajectory

---

# The internal state that the move arm action currently is in
string state