ros2doctor.verb.hello module
- class ros2doctor.verb.hello.HelloMulticastUDPReceiver(summary_table, group='225.0.0.1', port=49150, timeout=None)
- Bases: - object- Receive ‘hello’ messages over a multicast UDP socket. - recv()
 - shutdown()
 
- class ros2doctor.verb.hello.HelloMulticastUDPSender(summary_table, group='225.0.0.1', port=49150, ttl=None)
- Bases: - object- Send ‘hello’ messages over a multicast UDP socket. - send()
 - shutdown()
 
- class ros2doctor.verb.hello.HelloPublisher(node, topic, summary_table, *, qos=rclpy.qos.qos_profile_system_default)
- Bases: - object- Publish ‘hello’ messages over an std_msgs/msg/String topic. - destroy()
 - publish()
 
- class ros2doctor.verb.hello.HelloSubscriber(node, topic, summary_table, *, qos=rclpy.qos.qos_profile_system_default)
- Bases: - object- Subscribe to ‘hello’ messages over an std_msgs/msg/String topic. - destroy()
 
- class ros2doctor.verb.hello.HelloVerb
- Bases: - VerbExtension- Check network connectivity between multiple hosts. - This command can be invoked on multiple hosts to confirm that they can talk to each other by using talker/listener, multicast send/receive to check topic discovering and UDP communication. This command outputs a summary table of msgs statistics at a custom period(s). - add_arguments(parser, cli_name)
 - main(*, args, summary_table=None)
 
- class ros2doctor.verb.hello.SummaryTable
- Bases: - object- Summarize number of msgs published/sent and subscribed/received. - format_print_summary(topic, print_period, *, group='225.0.0.1', port=49150)
- Print content in a table format. 
 - increment_pub()
- Increment published msg count. 
 - increment_receive(hostname)
- Increment multicast-received msg count from different host(s). 
 - increment_send()
- Increment multicast-sent msg count. 
 - increment_sub(hostname)
- Increment subscribed msg count from different host(s). 
 - reset()
- Reset summary table to empty each time after printing. 
 
- ros2doctor.verb.hello.positive(type_)
- ros2doctor.verb.hello.positive_float(string)
- ros2doctor.verb.hello.positive_int(string)