moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <trajectory_blend_response.h>
Public Attributes | |
std::string | group_name |
robot_trajectory::RobotTrajectoryPtr | first_trajectory |
robot_trajectory::RobotTrajectoryPtr | blend_trajectory |
robot_trajectory::RobotTrajectoryPtr | second_trajectory |
moveit_msgs::msg::MoveItErrorCodes | error_code |
Definition at line 43 of file trajectory_blend_response.h.
robot_trajectory::RobotTrajectoryPtr pilz_industrial_motion_planner::TrajectoryBlendResponse::blend_trajectory |
Definition at line 50 of file trajectory_blend_response.h.
moveit_msgs::msg::MoveItErrorCodes pilz_industrial_motion_planner::TrajectoryBlendResponse::error_code |
Definition at line 54 of file trajectory_blend_response.h.
robot_trajectory::RobotTrajectoryPtr pilz_industrial_motion_planner::TrajectoryBlendResponse::first_trajectory |
Definition at line 49 of file trajectory_blend_response.h.
std::string pilz_industrial_motion_planner::TrajectoryBlendResponse::group_name |
Definition at line 46 of file trajectory_blend_response.h.
robot_trajectory::RobotTrajectoryPtr pilz_industrial_motion_planner::TrajectoryBlendResponse::second_trajectory |
Definition at line 51 of file trajectory_blend_response.h.