Classes | |
| class | DummyClass |
| class | DummyTask |
Functions | |
| def | check_lower_bound |
| def | check_upper_bound |
| def | dummy_diagnostic |
Variables | |
| tuple | bounds = diagnostic_updater.CompositeDiagnosticTask("Bound check") |
| tuple | dc = DummyClass() |
| dictionary | freq_bounds = {'min':0.5, 'max':2} |
| tuple | lower |
| tuple | msg = std_msgs.msg.Bool() |
| tuple | pub1 = rospy.Publisher("topic1", std_msgs.msg.Bool) |
| tuple | pub1_freq |
| tuple | pub2_temp = rospy.Publisher("topic2", std_msgs.msg.Bool) |
| int | time_to_launch = 0 |
| tuple | updater = diagnostic_updater.Updater() |
| tuple | upper |
| def example.check_lower_bound | ( | stat | ) |
Definition at line 76 of file example.py.
| def example.check_upper_bound | ( | stat | ) |
Definition at line 85 of file example.py.
| def example.dummy_diagnostic | ( | stat | ) |
Definition at line 24 of file example.py.
| tuple example::bounds = diagnostic_updater.CompositeDiagnosticTask("Bound check") |
Definition at line 144 of file example.py.
| tuple example::dc = DummyClass() |
Definition at line 122 of file example.py.
| dictionary example::freq_bounds = {'min':0.5, 'max':2} |
Definition at line 181 of file example.py.
| tuple example::lower |
00001 diagnostic_updater.FunctionDiagnosticTask("Lower-bound check", 00002 check_lower_bound)
Definition at line 135 of file example.py.
| tuple example::msg = std_msgs.msg.Bool() |
Definition at line 204 of file example.py.
| tuple example::pub1 = rospy.Publisher("topic1", std_msgs.msg.Bool) |
Definition at line 160 of file example.py.
| tuple example::pub1_freq |
00001 diagnostic_updater.HeaderlessTopicDiagnostic("topic1", updater, 00002 diagnostic_updater.FrequencyStatusParam(freq_bounds, 0.1, 10))
Definition at line 183 of file example.py.
| tuple example::pub2_temp = rospy.Publisher("topic2", std_msgs.msg.Bool) |
Definition at line 161 of file example.py.
| int example::time_to_launch = 0 |
Definition at line 16 of file example.py.
| tuple example::updater = diagnostic_updater.Updater() |
Definition at line 100 of file example.py.
| tuple example::upper |
00001 diagnostic_updater.FunctionDiagnosticTask("Upper-bound check", 00002 check_upper_bound)
Definition at line 137 of file example.py.