#include <diagnostic.h>
Public Member Functions | |
Diagnostic () | |
void | newError (const std_msgs::String &message) |
void | removeError (const std_msgs::String &message) |
void | timerCallback (const ros::TimerEvent &) |
~Diagnostic () | |
Private Attributes | |
int | errorIndex |
std::vector< std::string > | errorList |
Lcd | lcd |
This class receive error messages from a diagnostic agregator node and display the messages every 5s on the lcd display until it receives a message from the agregator to remove the error message (ie the error doesn't exist anymore). It also uses tturn on the buzzer everytime a new error message arrives. It turns on the led red if an error message exist or green if everything is good.
Definition at line 12 of file diagnostic.h.
Definition at line 3 of file diagnostic.cpp.
Definition at line 8 of file diagnostic.cpp.
void Diagnostic::newError | ( | const std_msgs::String & | message | ) |
Definition at line 29 of file diagnostic.cpp.
void Diagnostic::removeError | ( | const std_msgs::String & | message | ) |
Definition at line 49 of file diagnostic.cpp.
void Diagnostic::timerCallback | ( | const ros::TimerEvent & | ) |
Definition at line 12 of file diagnostic.cpp.
int Diagnostic::errorIndex [private] |
Definition at line 23 of file diagnostic.h.
std::vector<std::string> Diagnostic::errorList [private] |
Definition at line 22 of file diagnostic.h.
Lcd Diagnostic::lcd [private] |
Definition at line 21 of file diagnostic.h.