static_map.hpp
Go to the documentation of this file.
1 
8 #ifndef mitre_fast_layered_map_static_map
9 #define mitre_fast_layered_map_static_map
10 #pragma once
11 
12 // STD
13 #include <string>
14 
15 // ROS
16 #include <ros/ros.h>
17 #include <nav_msgs/OccupancyGrid.h>
18 #include <visualization_msgs/Marker.h>
20 #include <tf2_ros/buffer.h>
22 
23 // Grid map
27 #include <grid_map_msgs/GridMap.h>
28 
29 namespace mitre_fast_layered_map
30 {
32  {
33  std::string mapName;
34  std::string staticMapSubTopic;
35  std::string markerSubTopic;
36  std::string gridMapSubTopic;
37  std::string gridMapLayer;
39 
40  std::string occupancyOutputTopic;
41  std::string gridmapOutputTopic;
42  };
43 
44  class StaticMap
45  {
46  public:
47  StaticMap();
49 
50  ~StaticMap();
51 
52  int init();
53  int once();
54 
55  void staticMapCb(const nav_msgs::OccupancyGrid &);
56  void mapMarkerCb(const visualization_msgs::Marker &);
57  void gridMapCb(const grid_map_msgs::GridMap &);
58 
59  int publishMap();
60 
61  private:
62 
63  // ROS ECOSYSTEM
70 
71  // TRANSFORMS
74 
75  // STATE DATA
76  bool initialized_{false};
77  bool recStaticMap_{false};
79 
81 
82  };
83 }
84 
85 #endif
std::string mapName
Name identification for the map.
Definition: static_map.hpp:33
std::string gridMapLayer
Layer to retrieve permanent obstacles from.
Definition: static_map.hpp:38
StaticMapConfiguration config_
Definition: static_map.hpp:80
std::string gridMapSubTopic
in the grid map will be added to the static map instance.
Definition: static_map.hpp:36
tf2_ros::Buffer tfBuffer_
Holds transformations from tf tree.
Definition: static_map.hpp:72
std::string staticMapSubTopic
Static map from map server to use as starting configuration.
Definition: static_map.hpp:34
std::string markerSubTopic
Topic users can post marker messages to to add obstacles.
Definition: static_map.hpp:35
tf2_ros::TransformListener tfListener_
Used in tfBuffer_.
Definition: static_map.hpp:73
std::string occupancyOutputTopic
Topic for occupancy grid.
Definition: static_map.hpp:40
std::string gridmapOutputTopic
Topic for grid map msgs output.
Definition: static_map.hpp:41


mitre_fast_layered_map
Author(s):
autogenerated on Thu Mar 11 2021 03:06:49