Nav2 Navigation Stack - rolling  main
ROS 2 Navigation Stack
obstacle_layer.hpp
1 /*********************************************************************
2  *
3  * Software License Agreement (BSD License)
4  *
5  * Copyright (c) 2008, 2013, Willow Garage, Inc.
6  * All rights reserved.
7  *
8  * Redistribution and use in source and binary forms, with or without
9  * modification, are permitted provided that the following conditions
10  * are met:
11  *
12  * * Redistributions of source code must retain the above copyright
13  * notice, this list of conditions and the following disclaimer.
14  * * Redistributions in binary form must reproduce the above
15  * copyright notice, this list of conditions and the following
16  * disclaimer in the documentation and/or other materials provided
17  * with the distribution.
18  * * Neither the name of Willow Garage, Inc. nor the names of its
19  * contributors may be used to endorse or promote products derived
20  * from this software without specific prior written permission.
21  *
22  * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
23  * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
24  * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
25  * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
26  * COPYRIGHT OWNER OR CONTRIBUTORS BE LIABLE FOR ANY DIRECT, INDIRECT,
27  * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING,
28  * BUT NOT LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES;
29  * LOSS OF USE, DATA, OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER
30  * CAUSED AND ON ANY THEORY OF LIABILITY, WHETHER IN CONTRACT, STRICT
31  * LIABILITY, OR TORT (INCLUDING NEGLIGENCE OR OTHERWISE) ARISING IN
32  * ANY WAY OUT OF THE USE OF THIS SOFTWARE, EVEN IF ADVISED OF THE
33  * POSSIBILITY OF SUCH DAMAGE.
34  *
35  * Author: Eitan Marder-Eppstein
36  * David V. Lu!!
37  *********************************************************************/
38 #ifndef NAV2_COSTMAP_2D__OBSTACLE_LAYER_HPP_
39 #define NAV2_COSTMAP_2D__OBSTACLE_LAYER_HPP_
40 
41 #include <memory>
42 #include <string>
43 #include <vector>
44 
45 #include "rclcpp/rclcpp.hpp"
46 #include "rclcpp/version.h"
47 #include "laser_geometry/laser_geometry.hpp"
48 #pragma GCC diagnostic push
49 #pragma GCC diagnostic ignored "-Wreorder"
50 #include "tf2_ros/message_filter.hpp"
51 #pragma GCC diagnostic pop
52 
53 #include "message_filters/subscriber.hpp"
54 #include "point_cloud_transport/subscriber_filter.hpp"
55 
56 #include "nav_msgs/msg/occupancy_grid.hpp"
57 #include "sensor_msgs/msg/laser_scan.hpp"
58 #include "sensor_msgs/msg/point_cloud.hpp"
59 #include "sensor_msgs/msg/point_cloud2.hpp"
60 #include "nav2_costmap_2d/costmap_layer.hpp"
61 #include "nav2_costmap_2d/layered_costmap.hpp"
62 #include "nav2_costmap_2d/observation_buffer.hpp"
63 #include "nav2_costmap_2d/footprint.hpp"
64 
65 namespace nav2_costmap_2d
66 {
67 
73 {
74 public:
79  {
80  costmap_ = NULL; // this is the unsigned char* member of parent class Costmap2D.
81  }
82 
86  virtual ~ObstacleLayer();
90  virtual void onInitialize();
101  virtual void updateBounds(
102  double robot_x, double robot_y, double robot_yaw, double * min_x,
103  double * min_y,
104  double * max_x,
105  double * max_y);
114  virtual void updateCosts(
115  nav2_costmap_2d::Costmap2D & master_grid,
116  int min_i, int min_j, int max_i, int max_j);
117 
121  virtual void deactivate();
122 
126  virtual void activate();
127 
131  virtual void reset();
132 
136  virtual bool isClearable() {return true;}
137 
142  rcl_interfaces::msg::SetParametersResult
143  dynamicParametersCallback(std::vector<rclcpp::Parameter> parameters);
144 
149 
155  void laserScanCallback(
156  sensor_msgs::msg::LaserScan::ConstSharedPtr message,
157  const std::shared_ptr<nav2_costmap_2d::ObservationBuffer> & buffer);
158 
165  sensor_msgs::msg::LaserScan::ConstSharedPtr message,
166  const std::shared_ptr<nav2_costmap_2d::ObservationBuffer> & buffer);
167 
173  void pointCloud2Callback(
174  sensor_msgs::msg::PointCloud2::ConstSharedPtr message,
175  const std::shared_ptr<nav2_costmap_2d::ObservationBuffer> & buffer);
176 
177  // for testing purposes
178  void addStaticObservation(nav2_costmap_2d::Observation & obs, bool marking, bool clearing);
179  void clearStaticObservations(bool marking, bool clearing);
180 
181 protected:
188  std::vector<nav2_costmap_2d::Observation> & marking_observations) const;
189 
196  std::vector<nav2_costmap_2d::Observation> & clearing_observations) const;
197 
206  virtual void raytraceFreespace(
207  const nav2_costmap_2d::Observation & clearing_observation,
208  double * min_x, double * min_y,
209  double * max_x,
210  double * max_y);
211 
216  double ox, double oy, double wx, double wy, double max_range, double min_range,
217  double * min_x, double * min_y,
218  double * max_x,
219  double * max_y);
220 
221  std::vector<geometry_msgs::msg::Point> transformed_footprint_;
222  bool footprint_clearing_enabled_;
226  void updateFootprint(
227  double robot_x, double robot_y, double robot_yaw, double * min_x,
228  double * min_y,
229  double * max_x,
230  double * max_y);
231 
232  std::string global_frame_;
235 
237  laser_geometry::LaserProjection projector_;
239  #if RCLCPP_VERSION_GTE(29, 6, 0)
240  std::vector<std::shared_ptr<message_filters::SubscriberBase>>
242  #else
243  std::vector<std::shared_ptr<message_filters::SubscriberBase<rclcpp_lifecycle::LifecycleNode>>>
245  #endif
247  std::vector<std::shared_ptr<tf2_ros::MessageFilterBase>> observation_notifiers_;
249  std::vector<std::shared_ptr<nav2_costmap_2d::ObservationBuffer>> observation_buffers_;
251  std::vector<std::shared_ptr<nav2_costmap_2d::ObservationBuffer>> marking_buffers_;
253  std::vector<std::shared_ptr<nav2_costmap_2d::ObservationBuffer>> clearing_buffers_;
254 
256  rclcpp::node_interfaces::OnSetParametersCallbackHandle::SharedPtr dyn_params_handler_;
257 
258  // Used only for testing purposes
259  std::vector<nav2_costmap_2d::Observation> static_clearing_observations_;
260  std::vector<nav2_costmap_2d::Observation> static_marking_observations_;
261 
262  bool rolling_window_;
263  bool was_reset_;
264  nav2_costmap_2d::CombinationMethod combination_method_;
265 };
266 
267 } // namespace nav2_costmap_2d
268 
269 #endif // NAV2_COSTMAP_2D__OBSTACLE_LAYER_HPP_
A 2D costmap provides a mapping between points in the world and their associated "costs".
Definition: costmap_2d.hpp:69
A costmap layer base class for costmap plugin layers. Rather than just a layer, this object also cont...
Stores an observation in terms of a point cloud and the origin of the source.
Definition: observation.hpp:47
Takes in laser and pointcloud data to populate into 2D costmap.
void pointCloud2Callback(sensor_msgs::msg::PointCloud2::ConstSharedPtr message, const std::shared_ptr< nav2_costmap_2d::ObservationBuffer > &buffer)
A callback to handle buffering PointCloud2 messages.
virtual bool isClearable()
If clearing operations should be processed on this layer or not.
std::vector< std::shared_ptr< nav2_costmap_2d::ObservationBuffer > > marking_buffers_
Used to store observation buffers used for marking obstacles.
virtual void activate()
Activate the layer.
std::vector< std::shared_ptr< tf2_ros::MessageFilterBase > > observation_notifiers_
Used to make sure that transforms are available for each sensor.
bool getMarkingObservations(std::vector< nav2_costmap_2d::Observation > &marking_observations) const
Get the observations used to mark space.
std::string global_frame_
The global frame for the costmap.
bool getClearingObservations(std::vector< nav2_costmap_2d::Observation > &clearing_observations) const
Get the observations used to clear space.
void updateRaytraceBounds(double ox, double oy, double wx, double wy, double max_range, double min_range, double *min_x, double *min_y, double *max_x, double *max_y)
Process update costmap with raytracing the window bounds.
rclcpp::node_interfaces::OnSetParametersCallbackHandle::SharedPtr dyn_params_handler_
Dynamic parameters handler.
void laserScanCallback(sensor_msgs::msg::LaserScan::ConstSharedPtr message, const std::shared_ptr< nav2_costmap_2d::ObservationBuffer > &buffer)
A callback to handle buffering LaserScan messages.
void resetBuffersLastUpdated()
triggers the update of observations buffer
std::vector< std::shared_ptr< nav2_costmap_2d::ObservationBuffer > > clearing_buffers_
Used to store observation buffers used for clearing obstacles.
void laserScanValidInfCallback(sensor_msgs::msg::LaserScan::ConstSharedPtr message, const std::shared_ptr< nav2_costmap_2d::ObservationBuffer > &buffer)
A callback to handle buffering LaserScan messages which need filtering to turn Inf values into range_...
std::vector< std::shared_ptr< message_filters::SubscriberBase< rclcpp_lifecycle::LifecycleNode > > > observation_subscribers_
Used for the observation message filters.
void updateFootprint(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y)
Clear costmap layer info below the robot's footprint.
virtual void deactivate()
Deactivate the layer.
virtual void updateCosts(nav2_costmap_2d::Costmap2D &master_grid, int min_i, int min_j, int max_i, int max_j)
Update the costs in the master costmap in the window.
rcl_interfaces::msg::SetParametersResult dynamicParametersCallback(std::vector< rclcpp::Parameter > parameters)
Callback executed when a parameter change is detected.
virtual ~ObstacleLayer()
A destructor.
std::vector< std::shared_ptr< nav2_costmap_2d::ObservationBuffer > > observation_buffers_
Used to store observations from various sensors.
virtual void onInitialize()
Initialization process of layer on startup.
double min_obstacle_height_
Max Obstacle Height.
laser_geometry::LaserProjection projector_
Used to project laser scans into point clouds.
double max_obstacle_height_
Max Obstacle Height.
virtual void reset()
Reset this costmap.
virtual void raytraceFreespace(const nav2_costmap_2d::Observation &clearing_observation, double *min_x, double *min_y, double *max_x, double *max_y)
Clear freespace based on one observation.
virtual void updateBounds(double robot_x, double robot_y, double robot_yaw, double *min_x, double *min_y, double *max_x, double *max_y)
Update the bounds of the master costmap by this layer's update dimensions.