Go to the documentation of this file.00001 #ifndef DIAGNOSTIC_H
00002 #define DIAGNOSTIC_H
00003
00004 #include <vector>
00005 #include <string>
00006 #include "lcd.hpp"
00007 #include <ros/ros.h>
00008 #include <std_msgs/String.h>
00009
00010 using namespace std;
00011
00012 class Diagnostic
00019 {
00020 private:
00021 Lcd lcd;
00022 std::vector<std::string> errorList;
00023 int errorIndex;
00024
00025 public:
00026 Diagnostic();
00027 ~Diagnostic();
00028 void newError(const std_msgs::String &message);
00029 void removeError(const std_msgs::String &message);
00030 void timerCallback(const ros::TimerEvent&);
00031
00032 };
00033
00034
00035
00036 #endif //DIAGNOSTIC_H