Public Member Functions | Private Member Functions | Private Attributes | List of all members
rosmon::ROSInterface Class Reference

#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< DiagnosticsPublisherm_diagnosticsPublisher
 
monitor::Monitorm_monitor
 
ros::NodeHandle m_nh
 
ros::Publisher m_pub_state
 
ros::ServiceServer m_srv_startStop
 
ros::WallTimer m_updateTimer
 

Detailed Description

Definition at line 17 of file ros_interface.h.

Constructor & Destructor Documentation

rosmon::ROSInterface::ROSInterface ( monitor::Monitor monitor,
bool  enableDiagnostics = false,
const std::string &  diagnosticsPrefix = {} 
)

Definition at line 13 of file ros_interface.cpp.

Member Function Documentation

bool rosmon::ROSInterface::handleStartStop ( rosmon_msgs::StartStopRequest &  req,
rosmon_msgs::StartStopResponse &  resp 
)
private

Definition at line 75 of file ros_interface.cpp.

void rosmon::ROSInterface::shutdown ( )

Definition at line 101 of file ros_interface.cpp.

void rosmon::ROSInterface::update ( )
private

Definition at line 29 of file ros_interface.cpp.

Member Data Documentation

bool rosmon::ROSInterface::m_diagnosticsEnabled
private

Definition at line 39 of file ros_interface.h.

std::unique_ptr<DiagnosticsPublisher> rosmon::ROSInterface::m_diagnosticsPublisher
private

Definition at line 40 of file ros_interface.h.

monitor::Monitor* rosmon::ROSInterface::m_monitor
private

Definition at line 29 of file ros_interface.h.

ros::NodeHandle rosmon::ROSInterface::m_nh
private

Definition at line 31 of file ros_interface.h.

ros::Publisher rosmon::ROSInterface::m_pub_state
private

Definition at line 35 of file ros_interface.h.

ros::ServiceServer rosmon::ROSInterface::m_srv_startStop
private

Definition at line 37 of file ros_interface.h.

ros::WallTimer rosmon::ROSInterface::m_updateTimer
private

Definition at line 33 of file ros_interface.h.


The documentation for this class was generated from the following files:


rosmon_core
Author(s): Max Schwarz
autogenerated on Wed Jul 10 2019 03:10:12