#include <trigger_matcher.h>
Public Types | |
typedef std::pair< ros::Time, boost::shared_ptr< C const > > | DataPair |
typedef boost::function< void(const ros::Time &, boost::shared_ptr< C const > &)> | MatchCallback |
Public Member Functions | |
void | dataCallback (const DataPair &pair) |
void | dataCallback (const ros::Time &stamp, const boost::shared_ptr< C const > &data) |
void | dataCallback (const ros::Time &stamp, const C &data) |
void | dataCallback (double stamp, const boost::shared_ptr< C const > &data) |
void | dataCallback (double stamp, const C &data) |
QueuedTriggerMatcher (unsigned int late_data_count_allowed, unsigned int max_trig_queue_length, unsigned int max_data_queue_length) | |
void | reset () |
void | setMatchCallback (MatchCallback &cb) |
virtual | ~QueuedTriggerMatcher () |
![]() | |
bool | hasTimestamp () |
void | setLateDataCountAllowed (unsigned int v) |
void | setTrigDelay (const ros::Duration &delay) |
void | setTrigDelay (double delay) |
void | triggerCallback (const ros::Time &stamp) |
void | triggerCallback (const std_msgs::HeaderConstPtr &msg) |
void | triggerCallback (double stamp) |
TriggerMatcherBase (unsigned int late_data_count_allowed, unsigned int max_trig_queue_length) | |
virtual | ~TriggerMatcherBase () |
Protected Member Functions | |
virtual void | gotTrigger () |
![]() | |
virtual void | baseReset () |
ros::Time | getTimestampNoblockPrelocked (const ros::Time &data_time) |
Static Private Member Functions | |
static void | DefaultCallback (const ros::Time &t, boost::shared_ptr< C const > &d) |
Private Attributes | |
std::queue< DataPair > | data_queue_ |
MatchCallback | match_callback_ |
unsigned int | max_data_queue_length_ |
Additional Inherited Members | |
![]() | |
bool | verbose_ |
![]() | |
static const ros::Time | DropData = ros::TIME_MIN |
static const ros::Time | RetryLater = ros::TIME_MAX |
![]() | |
boost::mutex | mutex_ |
Definition at line 316 of file trigger_matcher.h.
typedef std::pair<ros::Time, boost::shared_ptr<C const> > timestamp_tools::QueuedTriggerMatcher< C >::DataPair |
Definition at line 319 of file trigger_matcher.h.
typedef boost::function<void(const ros::Time &, boost::shared_ptr<C const> &)> timestamp_tools::QueuedTriggerMatcher< C >::MatchCallback |
Definition at line 320 of file trigger_matcher.h.
|
inlinevirtual |
Definition at line 353 of file trigger_matcher.h.
|
inline |
Definition at line 362 of file trigger_matcher.h.
|
inline |
Definition at line 398 of file trigger_matcher.h.
|
inline |
Definition at line 385 of file trigger_matcher.h.
|
inline |
Definition at line 374 of file trigger_matcher.h.
|
inline |
Definition at line 380 of file trigger_matcher.h.
|
inline |
Definition at line 369 of file trigger_matcher.h.
|
inlinestaticprivate |
Definition at line 327 of file trigger_matcher.h.
|
inlineprotectedvirtual |
Implements timestamp_tools::TriggerMatcherBase.
Definition at line 333 of file trigger_matcher.h.
|
inline |
Definition at line 390 of file trigger_matcher.h.
|
inline |
Definition at line 357 of file trigger_matcher.h.
|
private |
Definition at line 324 of file trigger_matcher.h.
|
private |
Definition at line 323 of file trigger_matcher.h.
|
private |
Definition at line 325 of file trigger_matcher.h.