Public Member Functions | |
| void | publishSinglePointPointcloud2 (const float x, const float y, const float z, const std::string frame_id, const ros::Time stamp) |
| void | publishTwist (const float lin, const float ang) |
| void | publishWatchdogReset () |
| SafetyLimiterTest () | |
Protected Attributes | |
| ros::Publisher | pub_cloud_ |
| ros::Publisher | pub_cmd_vel_ |
| ros::Publisher | pub_watchdog_ |
Static Protected Attributes | |
| ros::NodeHandle | nh_ |
Definition at line 67 of file test_safety_limiter.cpp.
| SafetyLimiterTest::SafetyLimiterTest | ( | ) | [inline] |
Definition at line 76 of file test_safety_limiter.cpp.
| void SafetyLimiterTest::publishSinglePointPointcloud2 | ( | const float | x, |
| const float | y, | ||
| const float | z, | ||
| const std::string | frame_id, | ||
| const ros::Time | stamp | ||
| ) | [inline] |
Definition at line 88 of file test_safety_limiter.cpp.
| void SafetyLimiterTest::publishTwist | ( | const float | lin, |
| const float | ang | ||
| ) | [inline] |
Definition at line 101 of file test_safety_limiter.cpp.
| void SafetyLimiterTest::publishWatchdogReset | ( | ) | [inline] |
Definition at line 83 of file test_safety_limiter.cpp.
ros::NodeHandle SafetyLimiterTest::nh_ [static, protected] |
Definition at line 70 of file test_safety_limiter.cpp.
ros::Publisher SafetyLimiterTest::pub_cloud_ [protected] |
Definition at line 72 of file test_safety_limiter.cpp.
ros::Publisher SafetyLimiterTest::pub_cmd_vel_ [protected] |
Definition at line 71 of file test_safety_limiter.cpp.
ros::Publisher SafetyLimiterTest::pub_watchdog_ [protected] |
Definition at line 73 of file test_safety_limiter.cpp.