53 bool computeService(
const std::shared_ptr<rmw_request_id_t>& request_header,
54 const std::shared_ptr<moveit_msgs::srv::GetCartesianPath::Request>& req,
55 const std::shared_ptr<moveit_msgs::srv::GetCartesianPath::Response>& res);
57 rclcpp::Service<moveit_msgs::srv::GetCartesianPath>::SharedPtr cartesian_path_service_;
58 rclcpp::Publisher<moveit_msgs::msg::DisplayTrajectory>::SharedPtr display_path_;
60 bool display_computed_paths_;