scenario_execution_ros.actions.ros_topic_wait_for_data module
- class scenario_execution_ros.actions.ros_topic_wait_for_data.RosTopicWaitForData(*args: Any, **kwargs: Any)
Bases:
BaseAction
Class to check if the message on ROS topic equals to the target message
- Args:
topic_name[str]: name of the topic to connect to topic_type[str]: class of the message type (e.g. std_msgs.msg.String) qos_profile[str]: qos profile for the subscriber
- execute()
- setup(**kwargs)
Setup the subscriber
- update() py_trees.common.Status