41#if __has_include(<realtime_tools/realtime_helpers.hpp>)
42#include <realtime_tools/realtime_helpers.hpp>
44#include <realtime_tools/thread_priority.hpp>
56rclcpp::Time convertClockType(
const rclcpp::Time& time, rcl_clock_type_t new_clock_type)
58 if (time.get_clock_type() != new_clock_type)
60 return rclcpp::Time(time.nanoseconds(), new_clock_type);
68 return node_->get_node_base_interface();
74 if (servo_loop_thread_.joinable())
75 servo_loop_thread_.join();
79 : node_{ std::make_shared<
rclcpp::Node>(
"servo_node", options) }
80 , stop_servo_{ false }
81 , servo_paused_{ false }
82 , new_joint_jog_msg_{ false }
83 , new_twist_msg_{ false }
84 , new_pose_msg_{ false }
89 if (realtime_tools::configure_sched_fifo(servo_params_.thread_priority))
91 RCLCPP_INFO_STREAM(node_->get_logger(),
"Enabled SCHED_FIFO and higher thread priority.");
95 RCLCPP_WARN_STREAM(node_->get_logger(),
"Could not enable FIFO RT scheduling policy. Continuing with the default.");
99 if (!realtime_tools::has_realtime_kernel())
101 RCLCPP_WARN_STREAM(node_->get_logger(),
"Realtime kernel is recommended for better performance.");
104 std::shared_ptr<servo::ParamListener> servo_param_listener =
105 std::make_shared<servo::ParamListener>(node_,
"moveit_servo");
109 servo_ = std::make_unique<Servo>(node_, servo_param_listener, planning_scene_monitor_);
111 servo_params_ = servo_->getParams();
114 joint_jog_subscriber_ = node_->create_subscription<control_msgs::msg::JointJog>(
115 servo_params_.joint_command_in_topic, rclcpp::SystemDefaultsQoS(),
116 [
this](
const control_msgs::msg::JointJog::ConstSharedPtr& msg) {
return jointJogCallback(msg); });
119 twist_subscriber_ = node_->create_subscription<geometry_msgs::msg::TwistStamped>(
120 servo_params_.cartesian_command_in_topic, rclcpp::SystemDefaultsQoS(),
121 [
this](
const geometry_msgs::msg::TwistStamped::ConstSharedPtr& msg) {
return twistCallback(msg); });
124 pose_subscriber_ = node_->create_subscription<geometry_msgs::msg::PoseStamped>(
125 servo_params_.pose_command_in_topic, rclcpp::SystemDefaultsQoS(),
126 [
this](
const geometry_msgs::msg::PoseStamped::ConstSharedPtr& msg) {
return poseCallback(msg); });
128 if (servo_params_.command_out_type ==
"trajectory_msgs/JointTrajectory")
130 trajectory_publisher_ = node_->create_publisher<trajectory_msgs::msg::JointTrajectory>(
131 servo_params_.command_out_topic, rclcpp::SystemDefaultsQoS());
133 else if (servo_params_.command_out_type ==
"std_msgs/Float64MultiArray")
135 multi_array_publisher_ = node_->create_publisher<std_msgs::msg::Float64MultiArray>(servo_params_.command_out_topic,
136 rclcpp::SystemDefaultsQoS());
140 node_->create_publisher<moveit_msgs::msg::ServoStatus>(servo_params_.status_topic, rclcpp::SystemDefaultsQoS());
143 switch_command_type_ = node_->create_service<moveit_msgs::srv::ServoCommandType>(
144 "~/switch_command_type", [
this](
const std::shared_ptr<moveit_msgs::srv::ServoCommandType::Request>& request,
145 const std::shared_ptr<moveit_msgs::srv::ServoCommandType::Response>& response) {
146 return switchCommandType(request, response);
150 pause_servo_ = node_->create_service<std_srvs::srv::SetBool>(
151 "~/pause_servo", [
this](
const std::shared_ptr<std_srvs::srv::SetBool::Request>& request,
152 const std::shared_ptr<std_srvs::srv::SetBool::Response>& response) {
153 return pauseServo(request, response);
157 servo_loop_thread_ = std::thread(&ServoNode::servoLoop,
this);
160void ServoNode::pauseServo(
const std::shared_ptr<std_srvs::srv::SetBool::Request>& request,
161 const std::shared_ptr<std_srvs::srv::SetBool::Response>& response)
163 if (servo_paused_ == request->data)
165 std::string message =
"Requested pause state is already active.";
166 RCLCPP_INFO(node_->get_logger(),
"%s", message.c_str());
167 response->success =
true;
168 response->message = message;
171 std::lock_guard<std::mutex> lock_guard(lock_);
172 servo_paused_ = request->data;
173 response->success = (servo_paused_ == request->data);
176 servo_->setCollisionChecking(
false);
177 response->message =
"Servoing disabled";
182 last_commanded_state_ = servo_->getCurrentRobotState(
true );
183 servo_->resetSmoothing(last_commanded_state_);
186 joint_cmd_rolling_window_.clear();
189 servo_->setCollisionChecking(
true);
190 response->message =
"Servoing enabled";
194void ServoNode::switchCommandType(
const std::shared_ptr<moveit_msgs::srv::ServoCommandType::Request>& request,
195 const std::shared_ptr<moveit_msgs::srv::ServoCommandType::Response>& response)
197 const bool is_valid = (request->command_type >=
static_cast<int8_t
>(
CommandType::MIN)) &&
201 servo_->setCommandType(
static_cast<CommandType>(request->command_type));
205 RCLCPP_WARN_STREAM(node_->get_logger(),
"Unknown command type " << request->command_type <<
" requested");
207 response->success = (request->command_type ==
static_cast<int8_t
>(servo_->getCommandType()));
210void ServoNode::jointJogCallback(
const control_msgs::msg::JointJog::ConstSharedPtr& msg)
212 latest_joint_jog_ = *msg;
213 new_joint_jog_msg_ =
true;
216void ServoNode::twistCallback(
const geometry_msgs::msg::TwistStamped::ConstSharedPtr& msg)
218 latest_twist_ = *msg;
219 new_twist_msg_ =
true;
222void ServoNode::poseCallback(
const geometry_msgs::msg::PoseStamped::ConstSharedPtr& msg)
225 new_pose_msg_ =
true;
228std::optional<KinematicState> ServoNode::processJointJogCommand(
const moveit::core::RobotStatePtr& robot_state)
230 std::optional<KinematicState> next_joint_state = std::nullopt;
232 new_twist_msg_ = new_pose_msg_ =
false;
234 if (!latest_joint_jog_.displacements.empty())
236 RCLCPP_WARN(node_->get_logger(),
"Joint jog command displacements field is not yet supported, ignoring.");
237 latest_joint_jog_.displacements.clear();
240 const bool command_stale = (node_->now() - latest_joint_jog_.header.stamp) >=
241 rclcpp::Duration::from_seconds(servo_params_.incoming_command_timeout);
244 JointJogCommand command{ latest_joint_jog_.joint_names, latest_joint_jog_.velocities };
245 next_joint_state = servo_->getNextJointState(robot_state, command);
249 new_joint_jog_msg_ =
false;
254 auto result = servo_->smoothHalt(last_commanded_state_);
255 new_joint_jog_msg_ = !result.first;
256 if (new_joint_jog_msg_)
258 next_joint_state = result.second;
259 RCLCPP_DEBUG_STREAM(node_->get_logger(),
"Joint jog command timed out. Halting to a stop.");
263 return next_joint_state;
266std::optional<KinematicState> ServoNode::processTwistCommand(
const moveit::core::RobotStatePtr& robot_state)
268 std::optional<KinematicState> next_joint_state = std::nullopt;
272 new_joint_jog_msg_ = new_pose_msg_ =
false;
274 const bool command_stale = (node_->now() - latest_twist_.header.stamp) >=
275 rclcpp::Duration::from_seconds(servo_params_.incoming_command_timeout);
278 const Eigen::Vector<double, 6> velocities{ latest_twist_.twist.linear.x, latest_twist_.twist.linear.y,
279 latest_twist_.twist.linear.z, latest_twist_.twist.angular.x,
280 latest_twist_.twist.angular.y, latest_twist_.twist.angular.z };
281 const TwistCommand command{ latest_twist_.header.frame_id, velocities };
282 next_joint_state = servo_->getNextJointState(robot_state, command);
285 new_twist_msg_ =
false;
290 auto result = servo_->smoothHalt(last_commanded_state_);
291 new_twist_msg_ = !result.first;
294 next_joint_state = result.second;
295 RCLCPP_DEBUG_STREAM(node_->get_logger(),
"Twist command timed out. Halting to a stop.");
299 return next_joint_state;
302std::optional<KinematicState> ServoNode::processPoseCommand(
const moveit::core::RobotStatePtr& robot_state)
304 std::optional<KinematicState> next_joint_state = std::nullopt;
308 new_joint_jog_msg_ = new_twist_msg_ =
false;
310 const bool command_stale = (node_->now() - latest_pose_.header.stamp) >=
311 rclcpp::Duration::from_seconds(servo_params_.incoming_command_timeout);
315 next_joint_state = servo_->getNextJointState(robot_state, command);
318 new_pose_msg_ =
false;
323 auto result = servo_->smoothHalt(last_commanded_state_);
324 new_pose_msg_ = !result.first;
327 next_joint_state = result.second;
328 RCLCPP_DEBUG_STREAM(node_->get_logger(),
"Pose command timed out. Halting to a stop.");
332 return next_joint_state;
335void ServoNode::servoLoop()
337 moveit_msgs::msg::ServoStatus status_msg;
338 std::optional<KinematicState> next_joint_state = std::nullopt;
339 rclcpp::WallRate servo_frequency(1 / servo_params_.publish_period);
341 const auto servo_node_start = node_->now();
345 while (servo_node_start >
346 convertClockType(planning_scene_monitor_->getLastUpdateTime(), servo_node_start.get_clock_type()))
348 RCLCPP_INFO(node_->get_logger(),
"Waiting for planning scene monitor to receive robot state update.");
349 rclcpp::sleep_for(std::chrono::seconds(1));
352 RCLCPP_INFO(node_->get_logger(),
"Waiting to receive robot state update.");
353 rclcpp::sleep_for(std::chrono::seconds(1));
355 KinematicState current_state = servo_->getCurrentRobotState(
true );
356 last_commanded_state_ = current_state;
358 servo_->resetSmoothing(current_state);
361 moveit::core::RobotStatePtr robot_state = planning_scene_monitor_->getStateMonitor()->getCurrentState();
363 robot_state->getJointModelGroup(servo_params_.move_group_name);
365 while (rclcpp::ok() && !stop_servo_)
370 servo_->resetSmoothing(current_state);
371 servo_frequency.sleep();
376 std::lock_guard<std::mutex> lock_guard(lock_);
377 const bool use_trajectory = servo_params_.command_out_type ==
"trajectory_msgs/JointTrajectory";
378 const auto cur_time = node_->now();
380 if (use_trajectory && !joint_cmd_rolling_window_.empty() && joint_cmd_rolling_window_.back().time_stamp > cur_time)
382 current_state = joint_cmd_rolling_window_.back();
387 joint_cmd_rolling_window_.clear();
388 current_state = servo_->getCurrentRobotState(
false );
389 current_state.velocities *= 0.0;
393 robot_state->setJointGroupPositions(joint_model_group, current_state.positions);
394 robot_state->setJointGroupVelocities(joint_model_group, current_state.velocities);
396 next_joint_state = std::nullopt;
397 const CommandType expected_type = servo_->getCommandType();
401 next_joint_state = processJointJogCommand(robot_state);
405 next_joint_state = processTwistCommand(robot_state);
409 next_joint_state = processPoseCommand(robot_state);
411 else if (new_joint_jog_msg_ || new_twist_msg_ || new_pose_msg_)
413 new_joint_jog_msg_ = new_twist_msg_ = new_pose_msg_ =
false;
414 RCLCPP_WARN_STREAM(node_->get_logger(),
"Command type has not been set, cannot accept input");
422 auto& next_joint_state_value = next_joint_state.value();
423 updateSlidingWindow(next_joint_state_value, joint_cmd_rolling_window_, servo_params_.max_expected_latency,
427 trajectory_publisher_->publish(msg.value());
434 last_commanded_state_ = next_joint_state.value();
439 last_commanded_state_ = current_state = servo_->getCurrentRobotState(
false);
440 updateSlidingWindow(current_state, joint_cmd_rolling_window_, servo_params_.max_expected_latency, cur_time);
441 servo_->resetSmoothing(current_state);
444 status_msg.code =
static_cast<int8_t
>(servo_->getStatus());
445 status_msg.message = servo_->getStatusMessage();
446 status_publisher_->publish(status_msg);
449 servo_frequency.sleep();
455#include "rclcpp_components/register_node_macro.hpp"
rclcpp::node_interfaces::NodeBaseInterface::SharedPtr get_node_base_interface()
ServoNode(const rclcpp::NodeOptions &options)
std::optional< trajectory_msgs::msg::JointTrajectory > composeTrajectoryMessage(const servo::Params &servo_params, const std::deque< KinematicState > &joint_cmd_rolling_window)
Create a trajectory message from a rolling window queue of joint state commands. Method optionally re...
std_msgs::msg::Float64MultiArray composeMultiArrayMessage(const servo::Params &servo_params, const KinematicState &joint_state)
Create a Float64MultiArray message from given joint state.
void updateSlidingWindow(KinematicState &next_joint_state, std::deque< KinematicState > &joint_cmd_rolling_window, double max_expected_latency, const rclcpp::Time &cur_time)
Adds a new joint state command to a queue containing commands over a time window. Also modifies the v...
PoseCommand poseFromPoseStamped(const geometry_msgs::msg::PoseStamped &msg)
Convert a PoseStamped message to a Servo Pose.
planning_scene_monitor::PlanningSceneMonitorPtr createPlanningSceneMonitor(const rclcpp::Node::SharedPtr &node, const servo::Params &servo_params)
Creates the planning scene monitor used by servo.
void setNodeLoggerName(const std::string &name)
Call once after creating a node to initialize logging namespaces.