Classes | Namespaces | Functions | Variables
unittest_speed_observer.cpp File Reference
#include <thread>
#include <gmock/gmock.h>
#include <ros/ros.h>
#include <std_srvs/SetBool.h>
#include <tf2_ros/transform_broadcaster.h>
#include <pilz_utils/wait_for_service.h>
#include <pilz_testutils/async_test.h>
#include <prbt_hardware_support/FrameSpeeds.h>
#include <prbt_hardware_support/SetSpeedLimit.h>
#include <prbt_hardware_support/ros_test_helper.h>
#include <prbt_hardware_support/speed_observer.h>
Include dependency graph for unittest_speed_observer.cpp:

Go to the source code of this file.

Classes

class  speed_observer_test::SpeedObserverUnitTest
 

Namespaces

 speed_observer_test
 

Functions

int main (int argc, char *argv[])
 
 speed_observer_test::MATCHER_P (RunPermittedState, x,"RunPermitted state "+std::string(negation?"is not":"is")+": "+PrintToString(x)+".")
 
 speed_observer_test::MATCHER_P2 (NameAtI, i, name,"Name at index "+PrintToString(i)+std::string(negation?"is not":"is")+": "+name+".")
 
 speed_observer_test::MATCHER_P2 (SpeedAtIGe, i, x,"Speed at index "+PrintToString(i)+std::string(negation?"is not":"is")+" greater or equal to"+PrintToString(x)+".")
 
 speed_observer_test::MATCHER_P2 (SpeedAtILe, i, x,"Speed at index "+PrintToString(i)+std::string(negation?"is not":"is")+" less or equal to"+PrintToString(x)+".")
 
 speed_observer_test::TEST_F (SpeedObserverUnitTest, testStartupAndTopic)
 
 speed_observer_test::TEST_F (SpeedObserverUnitTest, testTooHighSpeed)
 
 speed_observer_test::TEST_F (SpeedObserverUnitTest, testSetSpeedLimit)
 
 speed_observer_test::TEST_F (SpeedObserverUnitTest, testTimeout)
 
 speed_observer_test::TEST_F (SpeedObserverUnitTest, testFailingRunPermittedServiceCase)
 
 speed_observer_test::TEST_F (SpeedObserverUnitTest, testSlowTfPublishing)
 

Variables

static const std::string speed_observer_test::BARRIER_FAST { "BARRIER_FAST" }
 
static const std::string speed_observer_test::BARRIER_LIMIT { "BARRIER_LIMIT" }
 
static const std::string speed_observer_test::BARRIER_LIMIT_LOW { "BARRIER_LIMIT_LOW" }
 
static const std::string speed_observer_test::BARRIER_SLOW { "BARRIER_SLOW" }
 
static const std::string speed_observer_test::FRAME_SPEEDS_TOPIC_NAME { "/frame_speeds" }
 
static constexpr double speed_observer_test::OBSERVER_FREQUENCY {3.0 * TEST_FREQUENCY}
 
static const std::string speed_observer_test::RUN_PERMITTED_SERVICE_NAME { "/run_permitted" }
 
static const double speed_observer_test::SQRT_2_HALF { 1 / sqrt(2) }
 
static const std::string speed_observer_test::TEST_BASE_FRAME { "test_base" }
 
static const std::string speed_observer_test::TEST_FRAME_A { "a" }
 
static const std::string speed_observer_test::TEST_FRAME_B { "b" }
 
static constexpr double speed_observer_test::TEST_FREQUENCY { 20 }
 

Function Documentation

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

Definition at line 491 of file unittest_speed_observer.cpp.



prbt_hardware_support
Author(s):
autogenerated on Tue Feb 2 2021 03:50:18