39 #ifndef DIAGNOSTIC_ANALYZER_H 40 #define DIAGNOSTIC_ANALYZER_H 45 #include <diagnostic_msgs/DiagnosticStatus.h> 46 #include <diagnostic_msgs/KeyValue.h> 131 virtual std::vector<boost::shared_ptr<diagnostic_msgs::DiagnosticStatus> >
report() = 0;
147 #endif //DIAGNOSTIC_ANALYZER_H virtual bool analyze(const boost::shared_ptr< StatusItem > item)=0
Returns true if analyzer will analyze this name.
virtual bool match(const std::string name)=0
Returns true if analyzer will handle this item.
virtual std::string getPath() const =0
Returns full prefix of analyzer. (ex: '/Robot/Sensors')
Analyzer()
Default constructor, called by pluginlib.
virtual bool init(const std::string base_path, const ros::NodeHandle &n)=0
Analyzer is initialized with base path and namespace.
virtual std::vector< boost::shared_ptr< diagnostic_msgs::DiagnosticStatus > > report()=0
Analysis function, output processed data.
Base class of all Analyzers. Loaded by aggregator.
virtual std::string getName() const =0
Returns nice name for display. (ex: 'Sensors')