FiltersDemo.hpp
Go to the documentation of this file.
1 /*
2  * FiltersDemo.hpp
3  *
4  * Created on: Aug 16, 2017
5  * Author: Peter Fankhauser
6  * Institute: ETH Zurich, ANYbotics
7  *
8  */
9 
10 #pragma once
11 
13 
14 #include <filters/filter_chain.h>
15 #include <ros/ros.h>
16 #include <string>
17 
18 namespace grid_map_demos {
19 
25 {
26  public:
27 
33  FiltersDemo(ros::NodeHandle& nodeHandle, bool& success);
34 
38  virtual ~FiltersDemo();
39 
44  bool readParameters();
45 
50  void callback(const grid_map_msgs::GridMap& message);
51 
52  private:
53 
56 
58  std::string inputTopic_;
59 
61  std::string outputTopic_;
62 
65 
68 
71 
74 };
75 
76 } /* namespace */
FiltersDemo(ros::NodeHandle &nodeHandle, bool &success)
Definition: FiltersDemo.cpp:16
std::string inputTopic_
Name of the input grid map topic.
Definition: FiltersDemo.hpp:58
ros::Subscriber subscriber_
Grid map subscriber.
Definition: FiltersDemo.hpp:64
ros::Publisher publisher_
Grid map publisher.
Definition: FiltersDemo.hpp:67
ros::NodeHandle & nodeHandle_
ROS nodehandle.
Definition: FiltersDemo.hpp:55
void callback(const grid_map_msgs::GridMap &message)
Definition: FiltersDemo.cpp:53
filters::FilterChain< grid_map::GridMap > filterChain_
Filter chain.
Definition: FiltersDemo.hpp:70
std::string filterChainParametersName_
Filter chain parameters name.
Definition: FiltersDemo.hpp:73
std::string outputTopic_
Name of the output grid map topic.
Definition: FiltersDemo.hpp:61


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