Go to the source code of this file.
Classes | |
| class | example.DummyClass |
| class | example.DummyTask |
Namespaces | |
| namespace | example |
Functions | |
| def | example.check_lower_bound |
| def | example.check_upper_bound |
| def | example.dummy_diagnostic |
Variables | |
| tuple | example.bounds = diagnostic_updater.CompositeDiagnosticTask("Bound check") |
| tuple | example.dc = DummyClass() |
| dictionary | example.freq_bounds = {'min':0.5, 'max':2} |
| tuple | example.lower |
| tuple | example.msg = std_msgs.msg.Bool() |
| tuple | example.pub1 = rospy.Publisher("topic1", std_msgs.msg.Bool) |
| tuple | example.pub1_freq |
| tuple | example.pub2_temp = rospy.Publisher("topic2", std_msgs.msg.Bool) |
| int | example.time_to_launch = 0 |
| tuple | example.updater = diagnostic_updater.Updater() |
| tuple | example.upper |