moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <planning_response.h>
Public Member Functions | |
MotionPlanResponse () | |
void | getMessage (moveit_msgs::msg::MotionPlanResponse &msg) const |
Public Attributes | |
robot_trajectory::RobotTrajectoryPtr | trajectory_ |
double | planning_time_ |
moveit_msgs::msg::MoveItErrorCodes | error_code_ |
Definition at line 46 of file planning_response.h.
|
inline |
Definition at line 48 of file planning_response.h.
void planning_interface::MotionPlanResponse::getMessage | ( | moveit_msgs::msg::MotionPlanResponse & | msg | ) | const |
Definition at line 40 of file planning_response.cpp.
moveit_msgs::msg::MoveItErrorCodes planning_interface::MotionPlanResponse::error_code_ |
Definition at line 56 of file planning_response.h.
double planning_interface::MotionPlanResponse::planning_time_ |
Definition at line 55 of file planning_response.h.
robot_trajectory::RobotTrajectoryPtr planning_interface::MotionPlanResponse::trajectory_ |
Definition at line 54 of file planning_response.h.