#include <planning_response.h>
Public Member Functions | |
void | getMessage (moveit_msgs::MotionPlanDetailedResponse &msg) const |
Public Attributes | |
std::vector< std::string > | description_ |
moveit_msgs::MoveItErrorCodes | error_code_ |
std::vector< double > | processing_time_ |
std::vector < robot_trajectory::RobotTrajectoryPtr > | trajectory_ |
Definition at line 62 of file planning_response.h.
void planning_interface::MotionPlanDetailedResponse::getMessage | ( | moveit_msgs::MotionPlanDetailedResponse & | msg | ) | const |
Definition at line 52 of file planning_response.cpp.
std::vector<std::string> planning_interface::MotionPlanDetailedResponse::description_ |
Definition at line 67 of file planning_response.h.
moveit_msgs::MoveItErrorCodes planning_interface::MotionPlanDetailedResponse::error_code_ |
Definition at line 69 of file planning_response.h.
std::vector<double> planning_interface::MotionPlanDetailedResponse::processing_time_ |
Definition at line 68 of file planning_response.h.
std::vector<robot_trajectory::RobotTrajectoryPtr> planning_interface::MotionPlanDetailedResponse::trajectory_ |
Definition at line 66 of file planning_response.h.