#include <topic_with_transform.h>
Public Member Functions | |
| void | subscribe (std::shared_ptr< TopicObserver< MsgType >> obs) | 
| TopicWithTransform (ros::NodeHandle nh, const std::string &topic_name, const std::string &target_frame, const double buffer_duration=5.0, const uint32_t tf_filter_queue_size=1000, const uint32_t subscribers_queue_size=1000) | |
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 | 
Definition at line 22 of file topic_with_transform.h.
      
  | 
  inline | 
Definition at line 30 of file topic_with_transform.h.
      
  | 
  inline | 
Definition at line 45 of file topic_with_transform.h.
      
  | 
  inlineprivate | 
Definition at line 49 of file topic_with_transform.h.
      
  | 
  private | 
Definition at line 77 of file topic_with_transform.h.
      
  | 
  private | 
Definition at line 78 of file topic_with_transform.h.
      
  | 
  private | 
Definition at line 75 of file topic_with_transform.h.
      
  | 
  private | 
Definition at line 74 of file topic_with_transform.h.
      
  | 
  private | 
Definition at line 76 of file topic_with_transform.h.