#include <planning_response.h>
Public Member Functions | |
| void | getMessage (moveit_msgs::MotionPlanResponse &msg) const |
| MotionPlanResponse () | |
Public Attributes | |
| moveit_msgs::MoveItErrorCodes | error_code_ |
| double | planning_time_ |
| robot_trajectory::RobotTrajectoryPtr | trajectory_ |
Definition at line 47 of file planning_response.h.
Definition at line 49 of file planning_response.h.
| void planning_interface::MotionPlanResponse::getMessage | ( | moveit_msgs::MotionPlanResponse & | msg | ) | const |
Definition at line 40 of file planning_response.cpp.
| moveit_msgs::MoveItErrorCodes planning_interface::MotionPlanResponse::error_code_ |
Definition at line 57 of file planning_response.h.
Definition at line 56 of file planning_response.h.
| robot_trajectory::RobotTrajectoryPtr planning_interface::MotionPlanResponse::trajectory_ |
Definition at line 55 of file planning_response.h.