14 #include <sensor_msgs/Image.h>
void imageCallback(const sensor_msgs::Image &msg)
double mapLengthX_
Length of the grid map in x direction.
grid_map::GridMap map_
Grid map data.
ros::Subscriber imageSubscriber_
Image subscriber.
ros::Publisher gridMapPublisher_
Grid map publisher.
double minHeight_
Range of the height values.
double resolution_
Resolution of the grid map.
std::string mapFrameId_
Frame id of the grid map.
ImageToGridmapDemo(ros::NodeHandle &nodeHandle)
std::string imageTopic_
Name of the grid map topic.
virtual ~ImageToGridmapDemo()
ros::NodeHandle & nodeHandle_
ROS nodehandle.