41 #include <control_msgs/action/follow_joint_trajectory.hpp>
42 #include <control_msgs/msg/joint_tolerance.hpp>
56 const std::string& action_ns)
58 node,
name, action_ns,
"moveit.simple_controller_manager.follow_joint_trajectory_controller_handle")
62 bool sendTrajectory(
const moveit_msgs::msg::RobotTrajectory& trajectory)
override;
68 static control_msgs::msg::JointTolerance&
getTolerance(std::vector<control_msgs::msg::JointTolerance>& tolerances,
69 const std::string&
name);
72 const rclcpp_action::ClientGoalHandle<control_msgs::action::FollowJointTrajectory>::WrappedResult& wrapped_result)
Base class for controller handles that interact with a controller through a ROS action server.
control_msgs::action::FollowJointTrajectory::Goal goal_template_
void controllerDoneCallback(const rclcpp_action::ClientGoalHandle< control_msgs::action::FollowJointTrajectory >::WrappedResult &wrapped_result) override
FollowJointTrajectoryControllerHandle(const rclcpp::Node::SharedPtr &node, const std::string &name, const std::string &action_ns)
static control_msgs::msg::JointTolerance & getTolerance(std::vector< control_msgs::msg::JointTolerance > &tolerances, const std::string &name)
bool sendTrajectory(const moveit_msgs::msg::RobotTrajectory &trajectory) override
Send a trajectory to the controller.