#include <ros_interface.h>
Public Member Functions | |
ROSInterface (monitor::Monitor *monitor, bool enableDiagnostics=false, const std::string &diagnosticsPrefix={}) | |
void | shutdown () |
Private Member Functions | |
bool | handleStartStop (rosmon_msgs::StartStopRequest &req, rosmon_msgs::StartStopResponse &resp) |
void | update () |
Private Attributes | |
bool | m_diagnosticsEnabled |
std::unique_ptr< DiagnosticsPublisher > | m_diagnosticsPublisher |
monitor::Monitor * | m_monitor |
ros::NodeHandle | m_nh |
ros::Publisher | m_pub_state |
ros::ServiceServer | m_srv_startStop |
ros::WallTimer | m_updateTimer |
Definition at line 17 of file ros_interface.h.
rosmon::ROSInterface::ROSInterface | ( | monitor::Monitor * | monitor, |
bool | enableDiagnostics = false , |
||
const std::string & | diagnosticsPrefix = {} |
||
) |
Definition at line 13 of file ros_interface.cpp.
|
private |
Definition at line 75 of file ros_interface.cpp.
void rosmon::ROSInterface::shutdown | ( | ) |
Definition at line 101 of file ros_interface.cpp.
|
private |
Definition at line 29 of file ros_interface.cpp.
|
private |
Definition at line 39 of file ros_interface.h.
|
private |
Definition at line 40 of file ros_interface.h.
|
private |
Definition at line 29 of file ros_interface.h.
|
private |
Definition at line 31 of file ros_interface.h.
|
private |
Definition at line 35 of file ros_interface.h.
|
private |
Definition at line 37 of file ros_interface.h.
|
private |
Definition at line 33 of file ros_interface.h.