#include <test_safety_limiter_base.h>
|
void | broadcastTF (const std::string parent_frame_id, const std::string child_frame_id, const float lin, const float ang) |
|
bool | hasDiag () const |
|
bool | hasStatus () const |
|
void | publishEmptyPointPointcloud2 (const std::string frame_id, const ros::Time stamp) |
|
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, const float lin_y=0.0) |
|
void | publishWatchdogReset () |
|
| SafetyLimiterTest () |
|
|
geometry_msgs::Twist::ConstPtr | cmd_vel_ |
|
diagnostic_msgs::DiagnosticArray::ConstPtr | diag_ |
|
safety_limiter_msgs::SafetyLimiterStatus::ConstPtr | status_ |
|
|
void | cbCmdVel (const geometry_msgs::Twist::ConstPtr &msg) |
|
void | cbDiag (const diagnostic_msgs::DiagnosticArray::ConstPtr &msg) |
|
void | cbStatus (const safety_limiter_msgs::SafetyLimiterStatus::ConstPtr &msg) |
|
Definition at line 81 of file test_safety_limiter_base.h.
◆ SafetyLimiterTest()
SafetyLimiterTest::SafetyLimiterTest |
( |
| ) |
|
|
inline |
◆ broadcastTF()
void SafetyLimiterTest::broadcastTF |
( |
const std::string |
parent_frame_id, |
|
|
const std::string |
child_frame_id, |
|
|
const float |
lin, |
|
|
const float |
ang |
|
) |
| |
|
inline |
◆ cbCmdVel()
void SafetyLimiterTest::cbCmdVel |
( |
const geometry_msgs::Twist::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ cbDiag()
void SafetyLimiterTest::cbDiag |
( |
const diagnostic_msgs::DiagnosticArray::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ cbStatus()
void SafetyLimiterTest::cbStatus |
( |
const safety_limiter_msgs::SafetyLimiterStatus::ConstPtr & |
msg | ) |
|
|
inlineprotected |
◆ hasDiag()
bool SafetyLimiterTest::hasDiag |
( |
| ) |
const |
|
inline |
◆ hasStatus()
bool SafetyLimiterTest::hasStatus |
( |
| ) |
const |
|
inline |
◆ publishEmptyPointPointcloud2()
void SafetyLimiterTest::publishEmptyPointPointcloud2 |
( |
const std::string |
frame_id, |
|
|
const ros::Time |
stamp |
|
) |
| |
|
inline |
◆ publishSinglePointPointcloud2()
void SafetyLimiterTest::publishSinglePointPointcloud2 |
( |
const float |
x, |
|
|
const float |
y, |
|
|
const float |
z, |
|
|
const std::string |
frame_id, |
|
|
const ros::Time |
stamp |
|
) |
| |
|
inline |
◆ publishTwist()
void SafetyLimiterTest::publishTwist |
( |
const float |
lin, |
|
|
const float |
ang, |
|
|
const float |
lin_y = 0.0 |
|
) |
| |
|
inline |
◆ publishWatchdogReset()
void SafetyLimiterTest::publishWatchdogReset |
( |
| ) |
|
|
inline |
◆ cmd_vel_
geometry_msgs::Twist::ConstPtr SafetyLimiterTest::cmd_vel_ |
◆ diag_
diagnostic_msgs::DiagnosticArray::ConstPtr SafetyLimiterTest::diag_ |
◆ nh_
◆ pub_cloud_
◆ pub_cmd_vel_
◆ pub_watchdog_
◆ status_
safety_limiter_msgs::SafetyLimiterStatus::ConstPtr SafetyLimiterTest::status_ |
◆ sub_cmd_vel_
◆ sub_diag_
◆ sub_status_
◆ tfb_
The documentation for this class was generated from the following file: