Classes | Functions | Variables
alb_publisher_test.cpp File Reference
#include <gtest/gtest.h>
#include "geometry_msgs/PoseStamped.h"
#include "nav_msgs/Odometry.h"
#include "ros/ros.h"
#include "sensor_msgs/PointCloud2.h"
#include "sensor_msgs/TimeReference.h"
#include "tf2_msgs/TFMessage.h"
#include "tlvParser.h"
#include "alb_common.h"
#include "alb_publisher.h"
#include "outsight_alb_driver/AugmentedCloud.h"
#include "outsight_alb_driver/TrackedObjects.h"
Include dependency graph for alb_publisher_test.cpp:

Go to the source code of this file.

Classes

class  AlbPublisherTest
 Class to test the AlbPublisher topics. More...
 

Functions

int main (int argc, char **argv)
 
 TEST_F (AlbPublisherTest, openTrackingFile)
 Test to check opening the tracking testing file. More...
 
 TEST_F (AlbPublisherTest, openSlamFile)
 Test to check opening the slam testing file. More...
 
 TEST_F (AlbPublisherTest, publishPointCloud)
 Test to check the PointCloud publisher. More...
 
 TEST_F (AlbPublisherTest, publishPose)
 Test to check the Pose publisher. More...
 
 TEST_F (AlbPublisherTest, publishTimeReference)
 Test to check the TimeReference publisher. More...
 
 TEST_F (AlbPublisherTest, publishTrackedObjects)
 Test to check the TrackedObjects publisher. More...
 
 TEST_F (AlbPublisherTest, publishEgomotion)
 Test to check the Egomotion publisher. More...
 
 TEST_F (AlbPublisherTest, publishOdometry)
 Test to check the Odometry publisher. More...
 
 TEST_F (AlbPublisherTest, publishAugmentedCloud)
 Test to check the AugmentedCloud publisher. More...
 
 TEST_F (AlbPublisherTest, broadcastAlbTransform)
 Test to check the odom to lidar tf broadcaster. More...
 

Variables

constexpr const char * k_alb_slam_file = "slam_test_file"
 
constexpr const char * k_alb_tracking_file = "tracking_test_file"
 
constexpr const size_t k_slam_messages = 54
 
constexpr const size_t k_tracking_messages = 60
 

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 278 of file alb_publisher_test.cpp.

◆ TEST_F() [1/10]

TEST_F ( AlbPublisherTest  ,
openTrackingFile   
)

Test to check opening the tracking testing file.

Definition at line 121 of file alb_publisher_test.cpp.

◆ TEST_F() [2/10]

TEST_F ( AlbPublisherTest  ,
openSlamFile   
)

Test to check opening the slam testing file.

Definition at line 128 of file alb_publisher_test.cpp.

◆ TEST_F() [3/10]

TEST_F ( AlbPublisherTest  ,
publishPointCloud   
)

Test to check the PointCloud publisher.

Definition at line 135 of file alb_publisher_test.cpp.

◆ TEST_F() [4/10]

TEST_F ( AlbPublisherTest  ,
publishPose   
)

Test to check the Pose publisher.

Definition at line 153 of file alb_publisher_test.cpp.

◆ TEST_F() [5/10]

TEST_F ( AlbPublisherTest  ,
publishTimeReference   
)

Test to check the TimeReference publisher.

Definition at line 171 of file alb_publisher_test.cpp.

◆ TEST_F() [6/10]

TEST_F ( AlbPublisherTest  ,
publishTrackedObjects   
)

Test to check the TrackedObjects publisher.

Definition at line 189 of file alb_publisher_test.cpp.

◆ TEST_F() [7/10]

TEST_F ( AlbPublisherTest  ,
publishEgomotion   
)

Test to check the Egomotion publisher.

Definition at line 207 of file alb_publisher_test.cpp.

◆ TEST_F() [8/10]

TEST_F ( AlbPublisherTest  ,
publishOdometry   
)

Test to check the Odometry publisher.

Definition at line 225 of file alb_publisher_test.cpp.

◆ TEST_F() [9/10]

TEST_F ( AlbPublisherTest  ,
publishAugmentedCloud   
)

Test to check the AugmentedCloud publisher.

Definition at line 243 of file alb_publisher_test.cpp.

◆ TEST_F() [10/10]

TEST_F ( AlbPublisherTest  ,
broadcastAlbTransform   
)

Test to check the odom to lidar tf broadcaster.

Definition at line 261 of file alb_publisher_test.cpp.

Variable Documentation

◆ k_alb_slam_file

constexpr const char* k_alb_slam_file = "slam_test_file"

Definition at line 23 of file alb_publisher_test.cpp.

◆ k_alb_tracking_file

constexpr const char* k_alb_tracking_file = "tracking_test_file"

Definition at line 22 of file alb_publisher_test.cpp.

◆ k_slam_messages

constexpr const size_t k_slam_messages = 54

Definition at line 26 of file alb_publisher_test.cpp.

◆ k_tracking_messages

constexpr const size_t k_tracking_messages = 60

Definition at line 25 of file alb_publisher_test.cpp.



outsight_alb_driver
Author(s): Outsight
autogenerated on Fri Oct 14 2022 02:29:51