message_filter_display.h
Go to the documentation of this file.
1 /*
2  * message_filter_display.h
3  *
4  * Created on: Jan 24, 2016
5  * Author: Péter Fankhauser
6  * Institute: ETH Zurich
7  */
8 
9 #pragma once
10 
11 #ifndef Q_MOC_RUN
14 #endif
15 
16 namespace grid_map_rviz_plugin {
17 
18 template<class MessageType>
20 {
21  public:
23 
24  void onInitialize()
25  {
26  #if ROS_VERSION_MINIMUM(1,14,0)
28  MFDClass::fixed_frame_.toStdString(),
30  #else
32  MFDClass::fixed_frame_.toStdString(),
34  #endif
35 
36  MFDClass::tf_filter_->connectInput(MFDClass::sub_);
37  MFDClass::tf_filter_->registerCallback(
38  boost::bind(&MFDClass::incomingMessage, this, _1));
40  MFDClass::tf_filter_, this);
41  }
42 
43 };
44 
45 } // end namespace
virtual tf::TransformListener * getTFClient() const =0
DisplayContext * context_
ros::NodeHandle update_nh_
MessageFilterDisplayMod< MessageType > MFDClass
tf::MessageFilter< MessageType > * tf_filter_
QString fixed_frame_
void registerFilterForTransformStatusCheck(tf::MessageFilter< M > *filter, Display *display)
virtual FrameManager * getFrameManager() const =0
void incomingMessage(const typename MessageType::ConstPtr &msg)
message_filters::Subscriber< MessageType > sub_
Connection registerCallback(const C &callback)


grid_map_rviz_plugin
Author(s): Philipp Krüsi, Péter Fankhauser
autogenerated on Tue Jun 25 2019 20:02:28