Namespaces | Functions
test_utils.h File Reference
#include <gtest/gtest.h>
#include <ros/ros.h>
#include <std_msgs/Header.h>
#include <sensor_msgs/Image.h>
#include <chrono>
#include <string>
#include <thread>
#include <ignition/msgs.hh>
Include dependency graph for test_utils.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 ros_ign_image
 
 ros_ign_image::testing
 

Functions

void ros_ign_image::testing::compareTestMsg (const ignition::msgs::Header &_msg)
 Compare a message with the populated for testing. More...
 
void ros_ign_image::testing::compareTestMsg (const ignition::msgs::Image &_msg)
 Compare a message with the populated for testing. More...
 
void ros_ign_image::testing::compareTestMsg (const sensor_msgs::Image &_msg)
 Compare a message with the populated for testing. More...
 
void ros_ign_image::testing::compareTestMsg (const std_msgs::Header &_msg)
 Compare a message with the populated for testing. More...
 
void ros_ign_image::testing::createTestMsg (ignition::msgs::Header &_msg)
 Ignition::msgs test utils. More...
 
void ros_ign_image::testing::createTestMsg (ignition::msgs::Image &_msg)
 Create a message used for testing. More...
 
void ros_ign_image::testing::createTestMsg (sensor_msgs::Image &_msg)
 Create a message used for testing. More...
 
void ros_ign_image::testing::createTestMsg (std_msgs::Header &_msg)
 ROS test utils. More...
 
template<class Rep , class Period >
void ros_ign_image::testing::waitUntilBoolVar (bool &_boolVar, const std::chrono::duration< Rep, Period > &_sleepEach, const int _retries)
 Wait until a boolean variable is set to true for a given number of times. More...
 
template<class Rep , class Period >
void ros_ign_image::testing::waitUntilBoolVarAndSpin (bool &_boolVar, const std::chrono::duration< Rep, Period > &_sleepEach, const int _retries)
 Wait until a boolean variable is set to true for a given number of times. This function calls ros::spinOnce each iteration. More...
 


ros_ign_image
Author(s):
autogenerated on Sat Mar 11 2023 04:02:19