moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
Data structure that represents information necessary to execute a trajectory. More...
#include <trajectory_execution_manager.h>
Public Attributes | |
std::vector< std::string > | controllers_ |
The controllers to use for executing the different trajectory parts;. | |
std::vector< moveit_msgs::msg::RobotTrajectory > | trajectory_parts_ |
Data structure that represents information necessary to execute a trajectory.
Definition at line 76 of file trajectory_execution_manager.h.
std::vector<std::string> trajectory_execution_manager::TrajectoryExecutionManager::TrajectoryExecutionContext::controllers_ |
The controllers to use for executing the different trajectory parts;.
Definition at line 79 of file trajectory_execution_manager.h.
std::vector<moveit_msgs::msg::RobotTrajectory> trajectory_execution_manager::TrajectoryExecutionManager::TrajectoryExecutionContext::trajectory_parts_ |
Definition at line 83 of file trajectory_execution_manager.h.