#include <pr2_mechanism_diagnostics.h>
| Public Member Functions | |
| CtrlJntDiagnosticPublisher () | |
| bool | ok () const | 
| void | publishDiag () | 
| ~CtrlJntDiagnosticPublisher () | |
| Private Member Functions | |
| void | mechCallback (const pr2_mechanism_msgs::MechanismStatistics::ConstPtr &mechMsg) | 
| Private Attributes | |
| std::map< std::string, boost::shared_ptr< ControllerStats > > | controller_stats | 
| ros::Publisher | diag_pub_ | 
| bool | disable_controller_warnings_ | 
| std::map< std::string, boost::shared_ptr< JointStats > > | joint_stats | 
| ros::Subscriber | mech_st_sub_ | 
| ros::NodeHandle | n_ | 
| ros::NodeHandle | pnh_ | 
| bool | use_sim_time_ | 
Publishes diagnostics data from pr2_mechanism_msgs/MechanismStatistics for joints and controllers.
Definition at line 94 of file pr2_mechanism_diagnostics.h.
| CtrlJntDiagnosticPublisher::CtrlJntDiagnosticPublisher | ( | ) | 
Definition at line 45 of file pr2_mechanism_diagnostics.cpp.
| 
 | inline | 
Definition at line 144 of file pr2_mechanism_diagnostics.h.
| 
 | private | 
Definition at line 62 of file pr2_mechanism_diagnostics.cpp.
| 
 | inline | 
Definition at line 148 of file pr2_mechanism_diagnostics.h.
| void CtrlJntDiagnosticPublisher::publishDiag | ( | ) | 
Publish diagnostics from joints, controllers
Definition at line 85 of file pr2_mechanism_diagnostics.cpp.
| 
 | private | 
Definition at line 130 of file pr2_mechanism_diagnostics.h.
| 
 | private | 
Definition at line 134 of file pr2_mechanism_diagnostics.h.
| 
 | private | 
Definition at line 137 of file pr2_mechanism_diagnostics.h.
| 
 | private | 
Definition at line 129 of file pr2_mechanism_diagnostics.h.
| 
 | private | 
Definition at line 133 of file pr2_mechanism_diagnostics.h.
| 
 | private | 
Definition at line 132 of file pr2_mechanism_diagnostics.h.
| 
 | private | 
Definition at line 132 of file pr2_mechanism_diagnostics.h.
| 
 | private | 
Definition at line 136 of file pr2_mechanism_diagnostics.h.