Classes | |
class | DummyClass |
class | DummyTask |
Functions | |
def | check_lower_bound (stat) |
def | check_upper_bound (stat) |
def | dummy_diagnostic (stat) |
Variables | |
bounds = diagnostic_updater.CompositeDiagnosticTask("Bound check") | |
data | |
dc = DummyClass() | |
dictionary | freq_bounds = {'min':0.5, 'max':2} |
lower | |
msg = std_msgs.msg.Bool() | |
pub1 = rospy.Publisher("topic1", std_msgs.msg.Bool, queue_size=10) | |
pub1_freq | |
pub2_temp = rospy.Publisher("topic2", std_msgs.msg.Bool, queue_size=10) | |
int | time_to_launch = 0 |
updater = diagnostic_updater.Updater() | |
upper | |
def example.check_lower_bound | ( | stat | ) |
Definition at line 109 of file example.py.
def example.check_upper_bound | ( | stat | ) |
Definition at line 118 of file example.py.
def example.dummy_diagnostic | ( | stat | ) |
Definition at line 57 of file example.py.
example.bounds = diagnostic_updater.CompositeDiagnosticTask("Bound check") |
Definition at line 177 of file example.py.
example.data |
Definition at line 242 of file example.py.
example.dc = DummyClass() |
Definition at line 155 of file example.py.
dictionary example.freq_bounds = {'min':0.5, 'max':2} |
Definition at line 214 of file example.py.
example.lower |
Definition at line 168 of file example.py.
example.msg = std_msgs.msg.Bool() |
Definition at line 237 of file example.py.
example.pub1 = rospy.Publisher("topic1", std_msgs.msg.Bool, queue_size=10) |
Definition at line 193 of file example.py.
example.pub1_freq |
Definition at line 216 of file example.py.
example.pub2_temp = rospy.Publisher("topic2", std_msgs.msg.Bool, queue_size=10) |
Definition at line 194 of file example.py.
int example.time_to_launch = 0 |
Definition at line 49 of file example.py.
example.updater = diagnostic_updater.Updater() |
Definition at line 133 of file example.py.
example.upper |
Definition at line 170 of file example.py.