moveit_msgs/MotionPlanResponse Message

File: moveit_msgs/MotionPlanResponse.msg

Raw Message Definition

# The representation of a solution to a planning problem

# The corresponding robot state
RobotState trajectory_start

# The group used for planning (usually the same as in the request)
string group_name

# A solution trajectory, if found
RobotTrajectory trajectory

# Planning time (seconds)
float64 planning_time

# Error code - encodes the overall reason for failure
MoveItErrorCodes error_code

Compact Message Definition

moveit_msgs/RobotState trajectory_start
string group_name
moveit_msgs/RobotTrajectory trajectory
float64 planning_time
moveit_msgs/MoveItErrorCodes error_code