Nav2 Navigation Stack - rolling  main
ROS 2 Navigation Stack
static_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__STATIC_LAYER_HPP_
39 #define NAV2_COSTMAP_2D__STATIC_LAYER_HPP_
40 
41 #include <mutex>
42 #include <string>
43 #include <vector>
44 
45 #include "map_msgs/msg/occupancy_grid_update.hpp"
46 #include "rclcpp/rclcpp.hpp"
47 #include "nav2_costmap_2d/costmap_layer.hpp"
48 #include "nav2_costmap_2d/layered_costmap.hpp"
49 #include "nav_msgs/msg/occupancy_grid.hpp"
50 #include "nav2_costmap_2d/footprint.hpp"
51 
52 namespace nav2_costmap_2d
53 {
54 
59 class StaticLayer : public CostmapLayer
60 {
61 public:
65  StaticLayer();
69  virtual ~StaticLayer();
70 
74  virtual void onInitialize();
75 
79  virtual void activate();
83  virtual void deactivate();
84 
88  virtual void reset();
89 
93  virtual bool isClearable() {return false;}
94 
105  virtual void updateBounds(
106  double robot_x, double robot_y, double robot_yaw, double * min_x,
107  double * min_y, double * max_x, double * max_y);
108 
117  virtual void updateCosts(
118  nav2_costmap_2d::Costmap2D & master_grid,
119  int min_i, int min_j, int max_i, int max_j);
120 
124  virtual void matchSize();
125 
126 protected:
130  void getParameters();
131 
135  void processMap(const nav_msgs::msg::OccupancyGrid & new_map);
136 
143  void incomingMap(const nav_msgs::msg::OccupancyGrid::SharedPtr new_map);
148  void incomingUpdate(map_msgs::msg::OccupancyGridUpdate::ConstSharedPtr update);
149 
154  unsigned char interpretValue(unsigned char value);
155 
163  bool isEqual(double a, double b, double epsilon);
164 
169  rcl_interfaces::msg::SetParametersResult
170  dynamicParametersCallback(std::vector<rclcpp::Parameter> parameters);
171 
172  std::vector<geometry_msgs::msg::Point> transformed_footprint_;
173  bool footprint_clearing_enabled_;
174  bool restore_cleared_footprint_;
178  void updateFootprint(
179  double robot_x, double robot_y, double robot_yaw, double * min_x,
180  double * min_y,
181  double * max_x,
182  double * max_y);
183 
184  std::string global_frame_;
185  std::string map_frame_;
186 
187  bool has_updated_data_{false};
188 
189  unsigned int x_{0};
190  unsigned int y_{0};
191  unsigned int width_{0};
192  unsigned int height_{0};
193 
194  nav2::Subscription<nav_msgs::msg::OccupancyGrid>::SharedPtr map_sub_;
195  nav2::Subscription<map_msgs::msg::OccupancyGridUpdate>::SharedPtr map_update_sub_;
196 
197  // Parameters
198  std::string map_topic_;
199  bool map_subscribe_transient_local_;
200  bool subscribe_to_updates_;
201  bool track_unknown_space_;
202  bool use_maximum_;
203  unsigned char lethal_threshold_;
204  unsigned char unknown_cost_value_;
205  bool trinary_costmap_;
206  bool map_received_{false};
207  bool map_received_in_update_bounds_{false};
208  tf2::Duration transform_tolerance_;
209  nav_msgs::msg::OccupancyGrid::SharedPtr map_buffer_;
210  // Dynamic parameters handler
211  rclcpp::node_interfaces::OnSetParametersCallbackHandle::SharedPtr dyn_params_handler_;
212 };
213 
214 } // namespace nav2_costmap_2d
215 
216 #endif // NAV2_COSTMAP_2D__STATIC_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...
Takes in a map generated from SLAM to add costs to costmap.
void getParameters()
Get parameters of layer.
virtual ~StaticLayer()
Static Layer destructor.
virtual void deactivate()
Deactivate this layer.
bool has_updated_data_
frame that map is located in
unsigned char interpretValue(unsigned char value)
Interpret the value in the static map given on the topic to convert into costs for the costmap to uti...
StaticLayer()
Static Layer constructor.
virtual void matchSize()
Match the size of the master costmap.
virtual void onInitialize()
Initialization process of layer on startup.
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 activate()
Activate this layer.
virtual bool isClearable()
If clearing operations should be processed on this layer or not.
void incomingUpdate(map_msgs::msg::OccupancyGridUpdate::ConstSharedPtr update)
Callback to update the costmap's map from the map_server (or SLAM) with an update in a particular are...
bool isEqual(double a, double b, double epsilon)
Check if two double values are equal within a given epsilon.
void incomingMap(const nav_msgs::msg::OccupancyGrid::SharedPtr new_map)
Callback to update the costmap's map from the map_server.
std::string global_frame_
The global frame for the costmap.
void processMap(const nav_msgs::msg::OccupancyGrid &new_map)
Process a new map coming from a topic.
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.
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.
rcl_interfaces::msg::SetParametersResult dynamicParametersCallback(std::vector< rclcpp::Parameter > parameters)
Callback executed when a parameter change is detected.
virtual void reset()
Reset this costmap.