Public Member Functions | Private Attributes | List of all members
grid_map_demos::FiltersDemo Class Reference

#include <FiltersDemo.hpp>

Public Member Functions

void callback (const grid_map_msgs::GridMap &message)
 
 FiltersDemo (ros::NodeHandle &nodeHandle, bool &success)
 
bool readParameters ()
 
virtual ~FiltersDemo ()
 

Private Attributes

filters::FilterChain< grid_map::GridMapfilterChain_
 Filter chain. More...
 
std::string filterChainParametersName_
 Filter chain parameters name. More...
 
std::string inputTopic_
 Name of the input grid map topic. More...
 
ros::NodeHandlenodeHandle_
 ROS nodehandle. More...
 
std::string outputTopic_
 Name of the output grid map topic. More...
 
ros::Publisher publisher_
 Grid map publisher. More...
 
ros::Subscriber subscriber_
 Grid map subscriber. More...
 

Detailed Description

Applies a chain of grid map filters to a topic and republishes the resulting grid map.

Definition at line 24 of file FiltersDemo.hpp.

Constructor & Destructor Documentation

grid_map_demos::FiltersDemo::FiltersDemo ( ros::NodeHandle nodeHandle,
bool &  success 
)

Constructor.

Parameters
nodeHandlethe ROS node handle.
successsignalizes if filter is configured ok or not.

Definition at line 16 of file FiltersDemo.cpp.

grid_map_demos::FiltersDemo::~FiltersDemo ( )
virtual

Destructor.

Definition at line 38 of file FiltersDemo.cpp.

Member Function Documentation

void grid_map_demos::FiltersDemo::callback ( const grid_map_msgs::GridMap &  message)

Callback method for the incoming grid map message.

Parameters
messagethe incoming message.

Definition at line 53 of file FiltersDemo.cpp.

bool grid_map_demos::FiltersDemo::readParameters ( )

Reads and verifies the ROS parameters.

Returns
true if successful.

Definition at line 42 of file FiltersDemo.cpp.

Member Data Documentation

filters::FilterChain<grid_map::GridMap> grid_map_demos::FiltersDemo::filterChain_
private

Filter chain.

Definition at line 70 of file FiltersDemo.hpp.

std::string grid_map_demos::FiltersDemo::filterChainParametersName_
private

Filter chain parameters name.

Definition at line 73 of file FiltersDemo.hpp.

std::string grid_map_demos::FiltersDemo::inputTopic_
private

Name of the input grid map topic.

Definition at line 58 of file FiltersDemo.hpp.

ros::NodeHandle& grid_map_demos::FiltersDemo::nodeHandle_
private

ROS nodehandle.

Definition at line 55 of file FiltersDemo.hpp.

std::string grid_map_demos::FiltersDemo::outputTopic_
private

Name of the output grid map topic.

Definition at line 61 of file FiltersDemo.hpp.

ros::Publisher grid_map_demos::FiltersDemo::publisher_
private

Grid map publisher.

Definition at line 67 of file FiltersDemo.hpp.

ros::Subscriber grid_map_demos::FiltersDemo::subscriber_
private

Grid map subscriber.

Definition at line 64 of file FiltersDemo.hpp.


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


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