17 #include "nav2_smoother/simple_smoother.hpp"
18 #include "nav2_core/smoother_exceptions.hpp"
20 namespace nav2_smoother
22 using namespace smoother_utils;
23 using namespace nav2_util::geometry_utils;
24 using namespace std::chrono;
25 using nav2::declare_parameter_if_not_declared;
27 void SimpleSmoother::configure(
28 const nav2::LifecycleNode::WeakPtr & parent,
29 std::string name, std::shared_ptr<tf2_ros::Buffer>,
30 std::shared_ptr<nav2_costmap_2d::CostmapSubscriber> costmap_sub,
31 std::shared_ptr<nav2_costmap_2d::FootprintSubscriber>)
33 costmap_sub_ = costmap_sub;
35 auto node = parent.lock();
36 logger_ = node->get_logger();
38 declare_parameter_if_not_declared(
39 node, name +
".tolerance", rclcpp::ParameterValue(1e-10));
40 declare_parameter_if_not_declared(
41 node, name +
".max_its", rclcpp::ParameterValue(1000));
42 declare_parameter_if_not_declared(
43 node, name +
".w_data", rclcpp::ParameterValue(0.2));
44 declare_parameter_if_not_declared(
45 node, name +
".w_smooth", rclcpp::ParameterValue(0.3));
46 declare_parameter_if_not_declared(
47 node, name +
".do_refinement", rclcpp::ParameterValue(
true));
48 declare_parameter_if_not_declared(
49 node, name +
".refinement_num", rclcpp::ParameterValue(2));
50 declare_parameter_if_not_declared(
51 node, name +
".enforce_path_inversion", rclcpp::ParameterValue(
true));
53 node->get_parameter(name +
".tolerance", tolerance_);
54 node->get_parameter(name +
".max_its", max_its_);
55 node->get_parameter(name +
".w_data", data_w_);
56 node->get_parameter(name +
".w_smooth", smooth_w_);
57 node->get_parameter(name +
".do_refinement", do_refinement_);
58 node->get_parameter(name +
".refinement_num", refinement_num_);
59 node->get_parameter(name +
".enforce_path_inversion", enforce_path_inversion_);
63 nav_msgs::msg::Path & path,
64 const rclcpp::Duration & max_time)
66 auto costmap = costmap_sub_->getCostmap();
68 steady_clock::time_point start = steady_clock::now();
69 double time_remaining = max_time.seconds();
71 bool reversing_segment;
72 nav_msgs::msg::Path curr_path_segment;
73 curr_path_segment.header = path.header;
76 0u,
static_cast<unsigned int>(path.poses.size() - 1)}};
77 if (enforce_path_inversion_) {
78 path_segments = findDirectionalPathSegments(path);
81 std::lock_guard<nav2_costmap_2d::Costmap2D::mutex_t> lock(*(costmap->getMutex()));
83 for (
unsigned int i = 0; i != path_segments.size(); i++) {
84 if (path_segments[i].end - path_segments[i].start > 3) {
86 curr_path_segment.poses.clear();
88 path.poses.begin() + path_segments[i].start,
89 path.poses.begin() + path_segments[i].end + 1,
90 std::back_inserter(curr_path_segment.poses));
93 steady_clock::time_point now = steady_clock::now();
94 time_remaining = max_time.seconds() - duration_cast<duration<double>>(now - start).count();
99 smoothImpl(curr_path_segment, reversing_segment, costmap.get(), time_remaining);
103 curr_path_segment.poses.begin(),
104 curr_path_segment.poses.end(),
105 path.poses.begin() + path_segments[i].start);
113 nav_msgs::msg::Path & path,
114 bool & reversing_segment,
116 const double & max_time)
118 steady_clock::time_point a = steady_clock::now();
119 rclcpp::Duration max_dur = rclcpp::Duration::from_seconds(max_time);
122 double change = tolerance_;
123 const unsigned int & path_size = path.poses.size();
124 double x_i, y_i, y_m1, y_ip1, y_i_org;
127 nav_msgs::msg::Path new_path = path;
128 nav_msgs::msg::Path last_path = path;
130 while (change >= tolerance_) {
135 if (its >= max_its_) {
138 "Number of iterations has exceeded limit of %i.", max_its_);
140 updateApproximatePathOrientations(path, reversing_segment);
145 steady_clock::time_point b = steady_clock::now();
146 rclcpp::Duration timespan(duration_cast<duration<double>>(b - a));
147 if (timespan > max_dur) {
150 "Smoothing time exceeded allowed duration of %0.2f.", max_time);
152 updateApproximatePathOrientations(path, reversing_segment);
156 for (
unsigned int i = 1; i != path_size - 1; i++) {
157 for (
unsigned int j = 0; j != 2; j++) {
158 x_i = getFieldByDim(path.poses[i], j);
159 y_i = getFieldByDim(new_path.poses[i], j);
160 y_m1 = getFieldByDim(new_path.poses[i - 1], j);
161 y_ip1 = getFieldByDim(new_path.poses[i + 1], j);
165 y_i += data_w_ * (x_i - y_i) + smooth_w_ * (y_ip1 + y_m1 - (2.0 * y_i));
166 setFieldByDim(new_path.poses[i], j, y_i);
167 change += abs(y_i - y_i_org);
174 getFieldByDim(new_path.poses[i], 0),
175 getFieldByDim(new_path.poses[i], 1),
177 cost =
static_cast<float>(costmap->
getCost(mx, my));
180 if (cost > nav2_costmap_2d::MAX_NON_OBSTACLE && cost != nav2_costmap_2d::NO_INFORMATION) {
182 rclcpp::get_logger(
"SmacPlannerSmoother"),
183 "Smoothing process resulted in an infeasible collision. "
184 "Returning the last path before the infeasibility was introduced.");
186 updateApproximatePathOrientations(path, reversing_segment);
191 last_path = new_path;
196 if (do_refinement_ && refinement_ctr_ < refinement_num_) {
198 smoothImpl(new_path, reversing_segment, costmap, max_time);
201 updateApproximatePathOrientations(new_path, reversing_segment);
206 const geometry_msgs::msg::PoseStamped & msg,
const unsigned int & dim)
209 return msg.pose.position.x;
210 }
else if (dim == 1) {
211 return msg.pose.position.y;
213 return msg.pose.position.z;
218 geometry_msgs::msg::PoseStamped & msg,
const unsigned int dim,
219 const double & value)
222 msg.pose.position.x = value;
223 }
else if (dim == 1) {
224 msg.pose.position.y = value;
226 msg.pose.position.z = value;
232 #include "pluginlib/class_list_macros.hpp"
smoother interface that acts as a virtual base class for all smoother plugins
A 2D costmap provides a mapping between points in the world and their associated "costs".
unsigned char getCost(unsigned int mx, unsigned int my) const
Get the cost of a cell in the costmap.
bool worldToMap(double wx, double wy, unsigned int &mx, unsigned int &my) const
Convert from world coordinates to map coordinates.
A path smoother implementation.
void setFieldByDim(geometry_msgs::msg::PoseStamped &msg, const unsigned int dim, const double &value)
Set the field value for a given dimension.
bool smooth(nav_msgs::msg::Path &path, const rclcpp::Duration &max_time) override
Method to smooth given path.
void smoothImpl(nav_msgs::msg::Path &path, bool &reversing_segment, const nav2_costmap_2d::Costmap2D *costmap, const double &max_time)
Smoother method - does the smoothing on a segment.
double getFieldByDim(const geometry_msgs::msg::PoseStamped &msg, const unsigned int &dim)
Get the field value for a given dimension.