GridmapToImageDemo.hpp
Go to the documentation of this file.
1 /*
2  * GridMapToImageDemo.hpp
3  *
4  * Created on: Oktober 19, 2020
5  * Author: Magnus Gärtner
6  * Institute: ETH Zurich, ANYbotics
7  *
8  */
9 
10 #pragma once
11 
12 // ROS
13 #include <ros/ros.h>
14 
15 #include <string>
16 
17 #include <grid_map_msgs/GridMap.h>
19 
20 namespace grid_map_demos {
21 
26  public:
32 
36  virtual ~GridMapToImageDemo();
37 
38  private:
42  void readParameters();
43 
49  void gridMapCallback(const grid_map_msgs::GridMap& msg);
50 
53 
56 
58  std::string gridMapTopic_;
59 
61  std::string filePath_;
62 };
63 
64 } // namespace grid_map_demos
void readParameters()
Reads and verifies the ROS parameters.
ros::Subscriber gridMapSubscriber_
GridMap subscriber.
std::string gridMapTopic_
Name of the grid map topic.
std::string filePath_
Path where to store the image.
ros::NodeHandle & nodeHandle_
ROS nodehandle.
void gridMapCallback(const grid_map_msgs::GridMap &msg)
The callback receiving the grid map. It will convert the elevation layer into a png image and save it...
GridMapToImageDemo(ros::NodeHandle &nodeHandle)


grid_map_demos
Author(s): Péter Fankhauser
autogenerated on Tue Jun 1 2021 02:13:55