|
template<typename PublisherType > |
| DiagnosedPublishAdapter (PublisherType publisher, diagnostic_updater::Updater &diag, const diagnostic_updater::FrequencyStatusParam &freq, const diagnostic_updater::TimeStampStatusParam &stamp) |
|
template<typename MessageType > |
void | publish (const MessageType &message) |
|
template<typename MessageType > |
void | publish (const std::shared_ptr< MessageType > &message) |
|
virtual | ~DiagnosedPublishAdapter () |
|
virtual void | tick () |
|
virtual void | tick () |
|
virtual void | tick () |
|
virtual void | tick () |
|
virtual void | tick () |
|
virtual void | tick (const rclcpp::Time &stamp) |
| Collects statistics and publishes the message. More...
|
|
virtual void | tick (const rclcpp::Time &stamp) |
| Collects statistics and publishes the message. More...
|
|
virtual void | tick (const rclcpp::Time &stamp) |
| Collects statistics and publishes the message. More...
|
|
virtual void | tick (const ros::Time &stamp) |
|
virtual void | tick (const ros::Time &stamp) |
| Collects statistics and publishes the message. More...
|
|
| TopicDiagnostic (std::string name, diagnostic_updater::Updater &diag, const diagnostic_updater::FrequencyStatusParam &freq, const diagnostic_updater::TimeStampStatusParam &stamp) |
|
| TopicDiagnostic (std::string name, diagnostic_updater::Updater &diag, const diagnostic_updater::FrequencyStatusParam &freq, const diagnostic_updater::TimeStampStatusParam &stamp) |
| Constructs a TopicDiagnostic. More...
|
|
| TopicDiagnostic (std::string name, diagnostic_updater::Updater &diag, const diagnostic_updater::FrequencyStatusParam &freq, const diagnostic_updater::TimeStampStatusParam &stamp) |
| Constructs a TopicDiagnostic. More...
|
|
| TopicDiagnostic (std::string name, diagnostic_updater::Updater &diag, const diagnostic_updater::FrequencyStatusParam &freq, const diagnostic_updater::TimeStampStatusParam &stamp, const rclcpp::Clock::SharedPtr &clock=std::make_shared< rclcpp::Clock >()) |
| Constructs a TopicDiagnostic. More...
|
|
| TopicDiagnostic (std::string name, diagnostic_updater::Updater &diag, const diagnostic_updater::FrequencyStatusParam &freq, const diagnostic_updater::TimeStampStatusParam &stamp, const rclcpp::Clock::SharedPtr &clock=std::make_shared< rclcpp::Clock >()) |
| Constructs a TopicDiagnostic. More...
|
|
virtual | ~TopicDiagnostic () |
|
virtual | ~TopicDiagnostic () |
|
virtual | ~TopicDiagnostic () |
|
virtual | ~TopicDiagnostic () |
|
virtual | ~TopicDiagnostic () |
|
void | addTask (DiagnosticTask *t) |
|
void | addTask (DiagnosticTask *t) |
| Adds a child CompositeDiagnosticTask. More...
|
|
void | addTask (DiagnosticTask *t) |
| Adds a child CompositeDiagnosticTask. More...
|
|
void | addTask (DiagnosticTask *t) |
| Adds a child CompositeDiagnosticTask. More...
|
|
void | addTask (DiagnosticTask *t) |
| Adds a child CompositeDiagnosticTask. More...
|
|
| CompositeDiagnosticTask (const std::string name) |
|
| CompositeDiagnosticTask (const std::string name) |
| Constructs a CompositeDiagnosticTask with the given name. More...
|
|
| CompositeDiagnosticTask (const std::string name) |
| Constructs a CompositeDiagnosticTask with the given name. More...
|
|
| CompositeDiagnosticTask (const std::string name) |
| Constructs a CompositeDiagnosticTask with the given name. More...
|
|
| CompositeDiagnosticTask (const std::string name) |
| Constructs a CompositeDiagnosticTask with the given name. More...
|
|
virtual void | run (DiagnosticStatusWrapper &stat) |
|
virtual void | run (DiagnosticStatusWrapper &stat) |
| Runs each child and merges their outputs. More...
|
|
virtual void | run (DiagnosticStatusWrapper &stat) |
| Runs each child and merges their outputs. More...
|
|
virtual void | run (DiagnosticStatusWrapper &stat) |
| Runs each child and merges their outputs. More...
|
|
virtual void | run (DiagnosticStatusWrapper &stat) |
| Runs each child and merges their outputs. More...
|
|
| DiagnosticTask (const std::string name) |
|
| DiagnosticTask (const std::string name) |
| Constructs a DiagnosticTask setting its name in the process. More...
|
|
| DiagnosticTask (const std::string name) |
| Constructs a DiagnosticTask setting its name in the process. More...
|
|
| DiagnosticTask (const std::string name) |
| Constructs a DiagnosticTask setting its name in the process. More...
|
|
| DiagnosticTask (const std::string name) |
| Constructs a DiagnosticTask setting its name in the process. More...
|
|
const std::string & | getName () |
|
const std::string & | getName () |
| Returns the name of the DiagnosticTask. More...
|
|
const std::string & | getName () |
| Returns the name of the DiagnosticTask. More...
|
|
const std::string & | getName () |
| Returns the name of the DiagnosticTask. More...
|
|
const std::string & | getName () |
| Returns the name of the DiagnosticTask. More...
|
|
virtual | ~DiagnosticTask () |
|
virtual | ~DiagnosticTask () |
|
virtual | ~DiagnosticTask () |
|
virtual | ~DiagnosticTask () |
|
virtual | ~DiagnosticTask () |
|
template<class DiagnosedPublisherT>
class sick_ldmrs_driver::DiagnosedPublishAdapter< DiagnosedPublisherT >
Definition at line 76 of file sick_ldmrs_driver.hpp.