44 #include <rclcpp_action/rclcpp_action.hpp>
45 #include <moveit_msgs/action/execute_trajectory.hpp>
62 void executePathCallback(
const std::shared_ptr<ExecTrajectoryGoal>& goal);
63 void executePath(
const std::shared_ptr<ExecTrajectoryGoal>& goal, std::shared_ptr<ExecTrajectory::Result>& action_res);
65 void preemptExecuteTrajectoryCallback();
66 void setExecuteTrajectoryState(
MoveGroupState state,
const std::shared_ptr<ExecTrajectoryGoal>& goal);
68 std::shared_ptr<rclcpp_action::Server<ExecTrajectory>> execute_action_server_;
MoveGroupExecuteTrajectoryAction()
void initialize() override
moveit_msgs::action::ExecuteTrajectory ExecTrajectory
rclcpp_action::ServerGoalHandle< ExecTrajectory > ExecTrajectoryGoal