Namespaces | Functions | Variables
unittest_brake_test_utils.cpp File Reference
#include <atomic>
#include <algorithm>
#include <mutex>
#include <thread>
#include <memory>
#include <gtest/gtest.h>
#include <ros/ros.h>
#include <sensor_msgs/JointState.h>
#include <pilz_testutils/joint_state_publisher_mock.h>
#include <pilz_utils/wait_for_message.h>
#include <prbt_hardware_support/brake_test_utils.h>
#include <prbt_hardware_support/brake_test_utils_exception.h>
Include dependency graph for unittest_brake_test_utils.cpp:

Go to the source code of this file.

Namespaces

 brake_test_utils_test
 

Functions

::testing::AssertionResult brake_test_utils_test::compareJointStateMessages (const JointStateConstPtr &msg1, const JointStateConstPtr &msg2)
 Checks for identical names and positions in joint state messages. More...
 
int main (int argc, char *argv[])
 
 brake_test_utils_test::TEST (BrakeTestUtilsTest, testExceptionDtor)
 Test increases function coverage by ensuring that all Dtor variants are called. More...
 
 brake_test_utils_test::TEST (BrakeTestUtilsTest, testCompareJointStatePositions)
 
 brake_test_utils_test::TEST (BrakeTestUtilsTest, testGetCurrentJointStates)
 
 brake_test_utils_test::TEST (BrakeTestUtilsTest, testDetectRobotMotion)
 

Variables

static const std::string brake_test_utils_test::JOINT_STATES_TOPIC_NAME { "/prbt/joint_states" }
 

Function Documentation

◆ main()

int main ( int  argc,
char *  argv[] 
)

Definition at line 218 of file unittest_brake_test_utils.cpp.



prbt_hardware_support
Author(s):
autogenerated on Mon Feb 28 2022 23:14:34