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 #pragma GCC diagnostic push
15 #pragma GCC diagnostic ignored "-Wpedantic"
16 #pragma GCC diagnostic ignored "-Wformat"
17 #include <filters/filter_chain.hpp>
18 #pragma GCC diagnostic pop
19 #include <ros/ros.h>
20 #include <string>
21 
22 namespace grid_map_demos {
23 
29 {
30  public:
31 
37  FiltersDemo(ros::NodeHandle& nodeHandle, bool& success);
38 
42  virtual ~FiltersDemo();
43 
48  bool readParameters();
49 
54  void callback(const grid_map_msgs::GridMap& message);
55 
56  private:
57 
60 
62  std::string inputTopic_;
63 
65  std::string outputTopic_;
66 
69 
72 
75 
78 };
79 
80 } /* namespace */
FiltersDemo(ros::NodeHandle &nodeHandle, bool &success)
Definition: FiltersDemo.cpp:16
std::string inputTopic_
Name of the input grid map topic.
Definition: FiltersDemo.hpp:62
ros::Subscriber subscriber_
Grid map subscriber.
Definition: FiltersDemo.hpp:68
ros::Publisher publisher_
Grid map publisher.
Definition: FiltersDemo.hpp:71
ros::NodeHandle & nodeHandle_
ROS nodehandle.
Definition: FiltersDemo.hpp:59
void callback(const grid_map_msgs::GridMap &message)
Definition: FiltersDemo.cpp:53
filters::FilterChain< grid_map::GridMap > filterChain_
Filter chain.
Definition: FiltersDemo.hpp:74
std::string filterChainParametersName_
Filter chain parameters name.
Definition: FiltersDemo.hpp:77
std::string outputTopic_
Name of the output grid map topic.
Definition: FiltersDemo.hpp:65


grid_map_demos
Author(s): Péter Fankhauser
autogenerated on Tue Jun 1 2021 02:13:55