23 #include "nav2_core/smoother_exceptions.hpp"
24 #include "nav2_smoother/nav2_smoother.hpp"
25 #include "nav2_util/node_utils.hpp"
26 #include "nav_2d_utils/conversions.hpp"
27 #include "nav_2d_utils/tf_help.hpp"
28 #include "tf2_ros/create_timer_ros.h"
30 using namespace std::chrono_literals;
32 namespace nav2_smoother
35 SmootherServer::SmootherServer(
const rclcpp::NodeOptions & options)
36 : LifecycleNode(
"smoother_server",
"", options),
37 lp_loader_(
"nav2_core",
"nav2_core::Smoother"),
38 default_ids_{
"simple_smoother"},
39 default_types_{
"nav2_smoother::SimpleSmoother"}
41 RCLCPP_INFO(get_logger(),
"Creating smoother server");
44 "costmap_topic", rclcpp::ParameterValue(
46 "global_costmap/costmap_raw")));
49 rclcpp::ParameterValue(
50 std::string(
"global_costmap/published_footprint")));
53 rclcpp::ParameterValue(std::string(
"base_link")));
54 declare_parameter(
"transform_tolerance", rclcpp::ParameterValue(0.1));
55 declare_parameter(
"smoother_plugins", default_ids_);
57 declare_parameter(
"action_server_result_timeout", 10.0);
65 nav2_util::CallbackReturn
68 RCLCPP_INFO(get_logger(),
"Configuring smoother server");
72 get_parameter(
"smoother_plugins", smoother_ids_);
73 if (smoother_ids_ == default_ids_) {
74 for (
size_t i = 0; i < default_ids_.size(); ++i) {
75 nav2_util::declare_parameter_if_not_declared(
76 node, default_ids_[i] +
".plugin",
77 rclcpp::ParameterValue(default_types_[i]));
81 tf_ = std::make_shared<tf2_ros::Buffer>(get_clock());
82 auto timer_interface = std::make_shared<tf2_ros::CreateTimerROS>(
83 get_node_base_interface(), get_node_timers_interface());
84 tf_->setCreateTimerInterface(timer_interface);
85 transform_listener_ = std::make_shared<tf2_ros::TransformListener>(*tf_);
87 std::string costmap_topic, footprint_topic, robot_base_frame;
88 double transform_tolerance;
89 this->get_parameter(
"costmap_topic", costmap_topic);
90 this->get_parameter(
"footprint_topic", footprint_topic);
91 this->get_parameter(
"transform_tolerance", transform_tolerance);
92 this->get_parameter(
"robot_base_frame", robot_base_frame);
93 costmap_sub_ = std::make_shared<nav2_costmap_2d::CostmapSubscriber>(
95 footprint_sub_ = std::make_shared<nav2_costmap_2d::FootprintSubscriber>(
96 shared_from_this(), footprint_topic, *tf_, robot_base_frame, transform_tolerance);
99 std::make_shared<nav2_costmap_2d::CostmapTopicCollisionChecker>(
100 *costmap_sub_, *footprint_sub_, this->get_name());
104 return nav2_util::CallbackReturn::FAILURE;
108 plan_publisher_ = create_publisher<nav_msgs::msg::Path>(
"plan_smoothed", 1);
110 double action_server_result_timeout;
111 get_parameter(
"action_server_result_timeout", action_server_result_timeout);
112 rcl_action_server_options_t server_options = rcl_action_server_get_default_options();
113 server_options.result_timeout.nanoseconds = RCL_S_TO_NS(action_server_result_timeout);
116 action_server_ = std::make_unique<ActionServer>(
121 std::chrono::milliseconds(500),
122 true, server_options);
124 return nav2_util::CallbackReturn::SUCCESS;
131 smoother_types_.resize(smoother_ids_.size());
133 for (
size_t i = 0; i != smoother_ids_.size(); i++) {
136 nav2_util::get_plugin_type_param(node, smoother_ids_[i]);
137 nav2_core::Smoother::Ptr smoother =
138 lp_loader_.createUniqueInstance(smoother_types_[i]);
140 get_logger(),
"Created smoother : %s of type %s",
141 smoother_ids_[i].c_str(), smoother_types_[i].c_str());
143 node, smoother_ids_[i], tf_, costmap_sub_,
145 smoothers_.insert({smoother_ids_[i], smoother});
146 }
catch (
const std::exception & ex) {
148 get_logger(),
"Failed to create smoother. Exception: %s",
154 for (
size_t i = 0; i != smoother_ids_.size(); i++) {
155 smoother_ids_concat_ += smoother_ids_[i] + std::string(
" ");
159 get_logger(),
"Smoother Server has %s smoothers available.",
160 smoother_ids_concat_.c_str());
165 nav2_util::CallbackReturn
168 RCLCPP_INFO(get_logger(),
"Activating");
170 plan_publisher_->on_activate();
171 SmootherMap::iterator it;
172 for (it = smoothers_.begin(); it != smoothers_.end(); ++it) {
173 it->second->activate();
175 action_server_->activate();
180 return nav2_util::CallbackReturn::SUCCESS;
183 nav2_util::CallbackReturn
186 RCLCPP_INFO(get_logger(),
"Deactivating");
188 action_server_->deactivate();
189 SmootherMap::iterator it;
190 for (it = smoothers_.begin(); it != smoothers_.end(); ++it) {
191 it->second->deactivate();
193 plan_publisher_->on_deactivate();
198 return nav2_util::CallbackReturn::SUCCESS;
201 nav2_util::CallbackReturn
204 RCLCPP_INFO(get_logger(),
"Cleaning up");
207 SmootherMap::iterator it;
208 for (it = smoothers_.begin(); it != smoothers_.end(); ++it) {
209 it->second->cleanup();
214 action_server_.reset();
215 plan_publisher_.reset();
216 transform_listener_.reset();
218 footprint_sub_.reset();
219 costmap_sub_.reset();
220 collision_checker_.reset();
222 return nav2_util::CallbackReturn::SUCCESS;
225 nav2_util::CallbackReturn
228 RCLCPP_INFO(get_logger(),
"Shutting down");
229 return nav2_util::CallbackReturn::SUCCESS;
233 const std::string & c_name,
234 std::string & current_smoother)
236 if (smoothers_.find(c_name) == smoothers_.end()) {
237 if (smoothers_.size() == 1 && c_name.empty()) {
240 "No smoother was specified in action call."
241 " Server will use only plugin loaded %s. "
242 "This warning will appear once.",
243 smoother_ids_concat_.c_str());
244 current_smoother = smoothers_.begin()->first;
248 "SmoothPath called with smoother name %s, "
249 "which does not exist. Available smoothers are: %s.",
250 c_name.c_str(), smoother_ids_concat_.c_str());
254 RCLCPP_DEBUG(get_logger(),
"Selected smoother: %s.", c_name.c_str());
255 current_smoother = c_name;
263 auto start_time = this->now();
265 RCLCPP_INFO(get_logger(),
"Received a path to smooth.");
267 auto result = std::make_shared<Action::Result>();
269 auto goal = action_server_->get_current_goal();
274 std::string c_name = goal->smoother_id;
275 std::string current_smoother;
277 current_smoother_ = current_smoother;
283 result->path = goal->path;
289 result->was_completed = smoothers_[current_smoother_]->smooth(
290 result->path, goal->max_smoothing_duration);
291 result->smoothing_duration = this->now() - start_time;
293 if (!result->was_completed) {
296 "Smoother %s did not complete smoothing in specified time limit"
297 "(%lf seconds) and was interrupted after %lf seconds",
298 current_smoother_.c_str(),
299 rclcpp::Duration(goal->max_smoothing_duration).seconds(),
300 rclcpp::Duration(result->smoothing_duration).seconds());
303 plan_publisher_->publish(result->path);
306 if (goal->check_for_collisions) {
307 geometry_msgs::msg::Pose2D pose2d;
308 bool fetch_data =
true;
309 for (
const auto & pose : result->path.poses) {
310 pose2d.x = pose.pose.position.x;
311 pose2d.y = pose.pose.position.y;
312 pose2d.theta = tf2::getYaw(pose.pose.orientation);
314 if (!collision_checker_->isCollisionFree(pose2d, fetch_data)) {
317 "Smoothed path leads to a collision at x: %lf, y: %lf, theta: %lf",
318 pose2d.x, pose2d.y, pose2d.theta);
320 "Smoothed Path collided at"
321 "X: " + std::to_string(pose2d.x) +
322 "Y: " + std::to_string(pose2d.y) +
323 "Theta: " + std::to_string(pose2d.theta));
330 get_logger(),
"Smoother succeeded (time: %lf), setting result",
331 rclcpp::Duration(result->smoothing_duration).seconds());
333 action_server_->succeeded_current(result);
335 RCLCPP_ERROR(this->get_logger(),
"%s", ex.what());
336 result->error_code = ActionResult::INVALID_SMOOTHER;
337 action_server_->terminate_current(result);
340 RCLCPP_ERROR(this->get_logger(),
"%s", ex.what());
341 result->error_code = ActionResult::TIMEOUT;
342 action_server_->terminate_current(result);
345 RCLCPP_ERROR(this->get_logger(),
"%s", ex.what());
346 result->error_code = ActionResult::SMOOTHED_PATH_IN_COLLISION;
347 action_server_->terminate_current(result);
350 RCLCPP_ERROR(this->get_logger(),
"%s", ex.what());
351 result->error_code = ActionResult::FAILED_TO_SMOOTH_PATH;
352 action_server_->terminate_current(result);
355 RCLCPP_ERROR(this->get_logger(),
"%s", ex.what());
356 result->error_code = ActionResult::INVALID_PATH;
357 action_server_->terminate_current(result);
360 RCLCPP_ERROR(this->get_logger(),
"%s", ex.what());
361 result->error_code = ActionResult::UNKNOWN;
362 action_server_->terminate_current(result);
364 }
catch (std::exception & ex) {
365 RCLCPP_ERROR(this->get_logger(),
"%s", ex.what());
366 result->error_code = ActionResult::UNKNOWN;
367 action_server_->terminate_current(result);
374 if (path.poses.empty()) {
375 RCLCPP_WARN(get_logger(),
"Requested path to smooth is empty");
379 RCLCPP_DEBUG(get_logger(),
"Requested path to smooth is valid");
385 #include "rclcpp_components/register_node_macro.hpp"
This class hosts variety of plugins of different algorithms to smooth or refine a path from the expos...
nav2_util::CallbackReturn on_activate(const rclcpp_lifecycle::State &state) override
Activates member variables.
~SmootherServer()
Destructor for nav2_smoother::SmootherServer.
nav2_util::CallbackReturn on_deactivate(const rclcpp_lifecycle::State &state) override
Deactivates member variables.
bool loadSmootherPlugins()
Loads smoother plugins from parameter file.
bool validate(const nav_msgs::msg::Path &path)
Validate that the path contains a meaningful path for smoothing.
nav2_util::CallbackReturn on_configure(const rclcpp_lifecycle::State &state) override
Configures smoother parameters and member variables.
nav2_util::CallbackReturn on_shutdown(const rclcpp_lifecycle::State &state) override
Called when in Shutdown state.
bool findSmootherId(const std::string &c_name, std::string &name)
Find the valid smoother ID name for the given request.
void smoothPlan()
SmoothPath action server callback. Handles action server updates and spins server until goal is reach...
nav2_util::CallbackReturn on_cleanup(const rclcpp_lifecycle::State &state) override
Calls clean up states and resets member variables.
std::shared_ptr< nav2_util::LifecycleNode > shared_from_this()
Get a shared pointer of this.
void createBond()
Create bond connection to lifecycle manager.
void destroyBond()
Destroy bond connection to lifecycle manager.