Public Member Functions | Public Attributes | Private Member Functions | Private Attributes
TopicWithTransform< MsgType > Class Template Reference

This class synchronizes the transform and odometry. More...

#include <topic_with_transform.h>

List of all members.

Public Member Functions

 TopicWithTransform (ros::NodeHandle nh, const std::string &topic_name, const std::string &target_frame, const double buffer_duration, const double tf_filter_queue_size, const double subscribers_queue_size)

Public Attributes

const uint32_t SUBSCR_QUEUE_SZ = 10000

Private Member Functions

void transformed_msg_cb (const boost::shared_ptr< MsgType > msg)

Private Attributes

std::unique_ptr
< tf::MessageFilter< MsgType > > 
_msg_flt
std::vector< std::weak_ptr
< TopicObserver< MsgType > > > 
_observers
message_filters::Subscriber
< MsgType > 
_subscr
std::string _target_frame
tf::TransformListener _tf_lsnr

Detailed Description

template<typename MsgType>
class TopicWithTransform< MsgType >

This class synchronizes the transform and odometry.

Definition at line 36 of file topic_with_transform.h.


Constructor & Destructor Documentation

template<typename MsgType>
TopicWithTransform< MsgType >::TopicWithTransform ( ros::NodeHandle  nh,
const std::string &  topic_name,
const std::string &  target_frame,
const double  buffer_duration,
const double  tf_filter_queue_size,
const double  subscribers_queue_size 
) [inline]

Definition at line 44 of file topic_with_transform.h.


Member Function Documentation

template<typename MsgType>
void TopicWithTransform< MsgType >::transformed_msg_cb ( const boost::shared_ptr< MsgType >  msg) [inline, private]

Definition at line 73 of file topic_with_transform.h.


Member Data Documentation

template<typename MsgType>
std::unique_ptr<tf::MessageFilter<MsgType> > TopicWithTransform< MsgType >::_msg_flt [private]

Definition at line 101 of file topic_with_transform.h.

template<typename MsgType>
std::vector<std::weak_ptr<TopicObserver<MsgType> > > TopicWithTransform< MsgType >::_observers [private]

Definition at line 102 of file topic_with_transform.h.

template<typename MsgType>
message_filters::Subscriber<MsgType> TopicWithTransform< MsgType >::_subscr [private]

Definition at line 99 of file topic_with_transform.h.

template<typename MsgType>
std::string TopicWithTransform< MsgType >::_target_frame [private]

Definition at line 98 of file topic_with_transform.h.

template<typename MsgType>
tf::TransformListener TopicWithTransform< MsgType >::_tf_lsnr [private]

Definition at line 100 of file topic_with_transform.h.

template<typename MsgType>
const uint32_t TopicWithTransform< MsgType >::SUBSCR_QUEUE_SZ = 10000

Definition at line 71 of file topic_with_transform.h.


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


tiny_slam
Author(s):
autogenerated on Thu Jun 6 2019 17:44:58