moveit2
The MoveIt Motion Planning Framework for ROS 2.
Classes | Namespaces | Typedefs
execute_trajectory_action_capability.h File Reference
#include <moveit/move_group/move_group_capability.h>
#include <rclcpp_action/rclcpp_action.hpp>
#include <moveit_msgs/action/execute_trajectory.hpp>
#include <memory>
Include dependency graph for execute_trajectory_action_capability.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  move_group::MoveGroupExecuteTrajectoryAction
 

Namespaces

 move_group
 

Typedefs

using move_group::ExecTrajectory = moveit_msgs::action::ExecuteTrajectory
 
using move_group::ExecTrajectoryGoal = rclcpp_action::ServerGoalHandle< ExecTrajectory >