Classes | Namespaces | Macros
message_filter.hpp File Reference

TF message filter. This is basically tf2_ros::MessageFilter, but with support for proper logging. More...

#include <algorithm>
#include <list>
#include <map>
#include <string>
#include <vector>
#include <boost/function.hpp>
#include <boost/bind/bind.hpp>
#include <boost/shared_ptr.hpp>
#include <boost/thread.hpp>
#include <cras_cpp_common/log_utils.h>
#include <message_filters/connection.h>
#include <message_filters/simple_filter.h>
#include <ros/node_handle.h>
#include <ros/callback_queue_interface.h>
#include <tf2/buffer_core.h>
#include <tf2_ros/message_filter.h>
Include dependency graph for message_filter.hpp:

Go to the source code of this file.

Classes

struct  cras::TfMessageFilter< M, >::CBQueueCallback
 
struct  cras::TfMessageFilter< M, >::MessageInfo
 
class  cras::TfMessageFilter< M, >
 Follows the patterns set by the message_filters package to implement a filter which only passes messages through once there is transform data available. More...
 

Namespaces

 cras
 

Macros

#define CRAS_TF_MESSAGEFILTER_DEBUG(fmt, ...)
 
#define CRAS_TF_MESSAGEFILTER_WARN(fmt, ...)
 

Detailed Description

TF message filter. This is basically tf2_ros::MessageFilter, but with support for proper logging.

Author
Josh Faust, Martin Pecka

Definition in file message_filter.hpp.

Macro Definition Documentation

◆ CRAS_TF_MESSAGEFILTER_DEBUG

#define CRAS_TF_MESSAGEFILTER_DEBUG (   fmt,
  ... 
)
Value:
CRAS_DEBUG_NAMED("message_filter", (std::string("MessageFilter [target=%s]: ") + std::string(fmt)).c_str(), \
getTargetFramesString().c_str(), __VA_ARGS__)
Author
Josh Faust

Definition at line 66 of file message_filter.hpp.

◆ CRAS_TF_MESSAGEFILTER_WARN

#define CRAS_TF_MESSAGEFILTER_WARN (   fmt,
  ... 
)
Value:
CRAS_WARN_NAMED("message_filter", (std::string("MessageFilter [target=%s]: ") + std::string(fmt)).c_str(), \
getTargetFramesString().c_str(), __VA_ARGS__)

Definition at line 70 of file message_filter.hpp.

CRAS_DEBUG_NAMED
#define CRAS_DEBUG_NAMED(name,...)
Definition: macros.h:409
CRAS_WARN_NAMED
#define CRAS_WARN_NAMED(name,...)
Definition: macros.h:609


cras_cpp_common
Author(s): Martin Pecka
autogenerated on Wed Apr 23 2025 02:48:42