Public Member Functions | Private Attributes
grid_map_demos::ImageToGridmapDemo Class Reference

#include <ImageToGridmapDemo.hpp>

List of all members.

Public Member Functions

void imageCallback (const sensor_msgs::Image &msg)
 ImageToGridmapDemo (ros::NodeHandle &nodeHandle)
bool readParameters ()
virtual ~ImageToGridmapDemo ()

Private Attributes

ros::Publisher gridMapPublisher_
 Grid map publisher.
ros::Subscriber imageSubscriber_
 Image subscriber.
std::string imageTopic_
 Name of the grid map topic.
grid_map::GridMap map_
 Grid map data.
std::string mapFrameId_
 Frame id of the grid map.
bool mapInitialized_
double mapLengthX_
 Length of the grid map in x direction.
double maxHeight_
double minHeight_
 Range of the height values.
ros::NodeHandle & nodeHandle_
 ROS nodehandle.
double resolution_
 Resolution of the grid map.

Detailed Description

Loads an image and saves it as layer 'elevation' of a grid map. The grid map is published and can be viewed in Rviz.

Definition at line 26 of file ImageToGridmapDemo.hpp.


Constructor & Destructor Documentation

grid_map_demos::ImageToGridmapDemo::ImageToGridmapDemo ( ros::NodeHandle &  nodeHandle)

Constructor.

Parameters:
nodeHandlethe ROS node handle.

Definition at line 13 of file ImageToGridmapDemo.cpp.

Destructor.

Definition at line 24 of file ImageToGridmapDemo.cpp.


Member Function Documentation

void grid_map_demos::ImageToGridmapDemo::imageCallback ( const sensor_msgs::Image &  msg)

Definition at line 37 of file ImageToGridmapDemo.cpp.

Reads and verifies the ROS parameters.

Returns:
true if successful.

Definition at line 28 of file ImageToGridmapDemo.cpp.


Member Data Documentation

Grid map publisher.

Definition at line 55 of file ImageToGridmapDemo.hpp.

Image subscriber.

Definition at line 61 of file ImageToGridmapDemo.hpp.

Name of the grid map topic.

Definition at line 64 of file ImageToGridmapDemo.hpp.

Grid map data.

Definition at line 58 of file ImageToGridmapDemo.hpp.

Frame id of the grid map.

Definition at line 77 of file ImageToGridmapDemo.hpp.

Definition at line 79 of file ImageToGridmapDemo.hpp.

Length of the grid map in x direction.

Definition at line 67 of file ImageToGridmapDemo.hpp.

Definition at line 74 of file ImageToGridmapDemo.hpp.

Range of the height values.

Definition at line 73 of file ImageToGridmapDemo.hpp.

ROS nodehandle.

Definition at line 52 of file ImageToGridmapDemo.hpp.

Resolution of the grid map.

Definition at line 70 of file ImageToGridmapDemo.hpp.


The documentation for this class was generated from the following files:


grid_map_demos
Author(s): Péter Fankhauser
autogenerated on Mon Oct 9 2017 03:09:38