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>
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, ...) |
TF message filter. This is basically tf2_ros::MessageFilter, but with support for proper logging.
Definition in file message_filter.hpp.
#define CRAS_TF_MESSAGEFILTER_DEBUG | ( | fmt, | |
... | |||
) |
Definition at line 66 of file message_filter.hpp.
#define CRAS_TF_MESSAGEFILTER_WARN | ( | fmt, | |
... | |||
) |
Definition at line 70 of file message_filter.hpp.