17 #include <grid_map_msgs/GridMap.h> 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.
virtual ~GridMapToImageDemo()
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)