Public Member Functions | Private Attributes | List of all members
swri::TypedSubscriberImpl< M, T > Class Template Reference

#include <subscriber_impl.h>

Inheritance diagram for swri::TypedSubscriberImpl< M, T >:
Inheritance graph
[legend]

Public Member Functions

template<class M2 >
boost::enable_if< ros::message_traits::HasHeader< M2 >, void >::type handleMessage (const boost::shared_ptr< M const > &msg)
 
template<class M2 >
boost::disable_if< ros::message_traits::HasHeader< M2 >, void >::type handleMessage (const boost::shared_ptr< M const > &msg)
 
 TypedSubscriberImpl (ros::NodeHandle &nh, const std::string &topic, uint32_t queue_size, void(T::*fp)(const boost::shared_ptr< M const > &), T *obj, const ros::TransportHints &transport_hints)
 
- Public Member Functions inherited from swri::SubscriberImpl
ros::Duration age (const ros::Time &now) const
 
bool blockTimeouts (bool block)
 
bool inTimeout ()
 
const std::string & mappedTopic () const
 
ros::Duration maxLatency () const
 
ros::Duration maxPeriod () const
 
double meanFrequencyHz () const
 
ros::Duration meanLatency () const
 
ros::Duration meanPeriod () const
 
int messageCount () const
 
ros::Duration minLatency () const
 
ros::Duration minPeriod () const
 
int numPublishers () const
 
void resetStatistics ()
 
void setTimeout (const ros::Duration &time_out)
 
 SubscriberImpl ()
 
ros::Duration timeout () const
 
int timeoutCount ()
 
bool timeoutEnabled () const
 
bool timeoutsBlocked () const
 
const std::string & unmappedTopic () const
 

Private Attributes

void(T::* callback_ )(const boost::shared_ptr< M const > &)
 
T * obj_
 

Additional Inherited Members

- Protected Member Functions inherited from swri::SubscriberImpl
void checkTimeout (const ros::Time &now)
 
void processHeader (const ros::Time &stamp)
 
- Protected Attributes inherited from swri::SubscriberImpl
bool blocking_timeout_
 
bool in_timeout_
 
ros::Time last_header_stamp_
 
ros::Time last_receive_time_
 
std::string mapped_topic_
 
ros::Duration max_latency_
 
ros::Duration max_period_
 
int message_count_
 
ros::Duration min_latency_
 
ros::Duration min_period_
 
ros::Subscriber sub_
 
ros::Duration timeout_
 
int timeout_count_
 
ros::Duration total_latency_
 
ros::Duration total_periods_
 
std::string unmapped_topic_
 

Detailed Description

template<class M, class T>
class swri::TypedSubscriberImpl< M, T >

Definition at line 295 of file subscriber_impl.h.

Constructor & Destructor Documentation

template<class M , class T >
swri::TypedSubscriberImpl< M, T >::TypedSubscriberImpl ( ros::NodeHandle nh,
const std::string &  topic,
uint32_t  queue_size,
void(T::*)(const boost::shared_ptr< M const > &)  fp,
T *  obj,
const ros::TransportHints transport_hints 
)
inline

Definition at line 301 of file subscriber_impl.h.

Member Function Documentation

template<class M , class T >
template<class M2 >
boost::enable_if< ros::message_traits::HasHeader<M2>, void>::type swri::TypedSubscriberImpl< M, T >::handleMessage ( const boost::shared_ptr< M const > &  msg)
inline

Definition at line 332 of file subscriber_impl.h.

template<class M , class T >
template<class M2 >
boost::disable_if< ros::message_traits::HasHeader<M2>, void>::type swri::TypedSubscriberImpl< M, T >::handleMessage ( const boost::shared_ptr< M const > &  msg)
inline

Definition at line 341 of file subscriber_impl.h.

Member Data Documentation

template<class M , class T >
void(T::* swri::TypedSubscriberImpl< M, T >::callback_) (const boost::shared_ptr< M const > &)
private

Definition at line 298 of file subscriber_impl.h.

template<class M , class T >
T* swri::TypedSubscriberImpl< M, T >::obj_
private

Definition at line 297 of file subscriber_impl.h.


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


swri_roscpp
Author(s):
autogenerated on Fri Jun 7 2019 22:05:50