Classes | Functions | Variables
message_filter_test.cpp File Reference
#include <geometry_msgs/PointStamped.h>
#include <geometry_msgs/TransformStamped.h>
#include <message_filters/subscriber.h>
#include <ros/ros.h>
#include <tf2_ros/buffer.h>
#include <tf2_ros/message_filter.h>
#include <tf2_ros/static_transform_broadcaster.h>
#include <tf2_ros/transform_listener.h>
#include <gtest/gtest.h>
#include <thread>
#include <chrono>
Include dependency graph for message_filter_test.cpp:

Go to the source code of this file.

Classes

class  MessageFilterFixture
 
class  MessageGenerator< M >
 
struct  MessageFilterFixture::Sink
 

Functions

void filter_callback (const geometry_msgs::PointStamped &msg)
 
 INSTANTIATE_TEST_CASE_P (MessageFilterTests, MessageFilterFixture, ::testing::Values(false, true))
 
int main (int argc, char **argv)
 
void spin_for_a_second ()
 
 TEST (tf2_ros_message_filter, multiple_frames_and_time_tolerance)
 
 TEST_P (MessageFilterFixture, StressTest)
 

Variables

bool filter_callback_fired = false
 

Function Documentation

◆ filter_callback()

void filter_callback ( const geometry_msgs::PointStamped &  msg)

Definition at line 55 of file message_filter_test.cpp.

◆ INSTANTIATE_TEST_CASE_P()

INSTANTIATE_TEST_CASE_P ( MessageFilterTests  ,
MessageFilterFixture  ,
::testing::Values(false, true)   
)

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 241 of file message_filter_test.cpp.

◆ spin_for_a_second()

void spin_for_a_second ( )

Definition at line 44 of file message_filter_test.cpp.

◆ TEST()

TEST ( tf2_ros_message_filter  ,
multiple_frames_and_time_tolerance   
)

Definition at line 60 of file message_filter_test.cpp.

◆ TEST_P()

TEST_P ( MessageFilterFixture  ,
StressTest   
)

Definition at line 211 of file message_filter_test.cpp.

Variable Documentation

◆ filter_callback_fired

bool filter_callback_fired = false

Definition at line 54 of file message_filter_test.cpp.



tf2_ros
Author(s): Eitan Marder-Eppstein, Wim Meeussen
autogenerated on Sun May 4 2025 02:16:35