#include <gtest/gtest.h>
#include <ros/ros.h>
#include <std_msgs/Bool.h>
#include <std_msgs/Empty.h>
#include <std_msgs/Float32.h>
#include <std_msgs/Float64.h>
#include <std_msgs/Header.h>
#include <std_msgs/Int32.h>
#include <std_msgs/String.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/PoseArray.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/Transform.h>
#include <geometry_msgs/TransformStamped.h>
#include <geometry_msgs/Twist.h>
#include <geometry_msgs/Quaternion.h>
#include <geometry_msgs/Vector3.h>
#include <nav_msgs/OccupancyGrid.h>
#include <nav_msgs/Odometry.h>
#include <rosgraph_msgs/Clock.h>
#include <sensor_msgs/BatteryState.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/FluidPressure.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/JointState.h>
#include <sensor_msgs/LaserScan.h>
#include <sensor_msgs/MagneticField.h>
#include <sensor_msgs/NavSatFix.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/PointField.h>
#include <tf2_msgs/TFMessage.h>
#include <visualization_msgs/Marker.h>
#include <visualization_msgs/MarkerArray.h>
#include <chrono>
#include <string>
#include <thread>
#include <ignition/msgs.hh>
Go to the source code of this file.
Namespaces | |
ros_ign_bridge | |
ros_ign_bridge::testing | |
Functions | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::Point &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::Pose &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::PoseArray &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::PoseStamped &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::Quaternion &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::Transform &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::TransformStamped &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::Twist &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const geometry_msgs::Vector3 &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Actuators &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Axis &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::BatteryState &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Boolean &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::CameraInfo &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Clock &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Color &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Double &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Empty &) |
Compare a message with the populated for testing. Noop for Empty. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Float &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::FluidPressure &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Header &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Image &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::IMU &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Int32 &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::LaserScan &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Magnetometer &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Marker &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Marker_V &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Model &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::NavSat &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::OccupancyGrid &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Odometry &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::PointCloudPacked &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Pose &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Pose_V &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Quaternion &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::StringMsg &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Twist &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const ignition::msgs::Vector3d &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const nav_msgs::OccupancyGrid &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const nav_msgs::Odometry &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const rosgraph_msgs::Clock &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::BatteryState &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::CameraInfo &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::FluidPressure &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::Image &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::Imu &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::JointState &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::LaserScan &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::MagneticField &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::NavSatFix &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const sensor_msgs::PointCloud2 &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const std_msgs::Bool &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const std_msgs::ColorRGBA &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const std_msgs::Empty &) |
Compare a message with the populated for testing. Noop for Empty. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const std_msgs::Float32 &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const std_msgs::Float64 &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const std_msgs::Header &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const std_msgs::Int32 &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const std_msgs::String &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const tf2_msgs::TFMessage &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const visualization_msgs::Marker &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::compareTestMsg (const visualization_msgs::MarkerArray &_msg) |
Compare a message with the populated for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::Point &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::Pose &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::PoseArray &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::PoseStamped &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::Quaternion &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::Transform &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::TransformStamped &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::Twist &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (geometry_msgs::Vector3 &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Actuators &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Axis &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::BatteryState &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Boolean &_msg) |
Ignition::msgs test utils. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::CameraInfo &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Clock &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Color &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Double &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Float &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::FluidPressure &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Header &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Image &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::IMU &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Int32 &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::LaserScan &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Magnetometer &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Marker &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Marker_V &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Model &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::NavSat &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::OccupancyGrid &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Odometry &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::PointCloudPacked &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Pose &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Pose_V &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Quaternion &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::StringMsg &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Twist &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (ignition::msgs::Vector3d &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (nav_msgs::OccupancyGrid &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (nav_msgs::Odometry &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (rosgraph_msgs::Clock &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::BatteryState &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::CameraInfo &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::FluidPressure &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::Image &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::Imu &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::JointState &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::LaserScan &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::MagneticField &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::NavSatFix &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (sensor_msgs::PointCloud2 &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (std_msgs::Bool &_msg) |
ROS test utils. More... | |
void | ros_ign_bridge::testing::createTestMsg (std_msgs::ColorRGBA &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (std_msgs::Float32 &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (std_msgs::Float64 &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (std_msgs::Header &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (std_msgs::Int32 &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (std_msgs::String &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (tf2_msgs::TFMessage &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (visualization_msgs::Marker &_msg) |
Create a message used for testing. More... | |
void | ros_ign_bridge::testing::createTestMsg (visualization_msgs::MarkerArray &_msg) |
Create a message used for testing. More... | |
template<class Rep , class Period > | |
void | ros_ign_bridge::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_bridge::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... | |