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