GridMapLoader.hpp
Go to the documentation of this file.
1 /*
2  * GridMapLoader.hpp
3  *
4  * Created on: Aug 24, 2015
5  * Author: Peter Fankhauser
6  * Institute: ETH Zurich, ANYbotics
7  *
8  */
9 
10 #pragma once
11 
12 // ROS
13 #include <ros/ros.h>
14 
15 // Grid map
17 
18 // STD
19 #include <string>
20 
21 namespace grid_map_loader {
22 
27 {
28  public:
29 
34  GridMapLoader(ros::NodeHandle nodeHandle);
35 
39  virtual ~GridMapLoader();
40 
45  bool readParameters();
46 
51  bool load();
52 
56  void publish();
57 
58  private:
59 
62 
65 
68 
70  std::string filePath_;
71 
73  std::string bagTopic_;
74 
76  std::string publishTopic_;
77 
80 };
81 
82 } /* namespace */
std::string filePath_
Path the ROS bag to be published.
grid_map::GridMap map_
Grid map data.
std::string publishTopic_
Topic name of the grid map to be loaded.
ros::Duration duration_
Duration to publish the grid map.
std::string bagTopic_
Topic name of the grid map in the ROS bag.
ros::NodeHandle nodeHandle_
ROS nodehandle.
GridMapLoader(ros::NodeHandle nodeHandle)
ros::Publisher publisher_
Grid map publisher.


grid_map_loader
Author(s): Péter Fankhauser
autogenerated on Tue Jun 25 2019 20:02:25