fake_uuid.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 # -*- coding: utf-8 -*-
3 
4 import rospy
5 from std_msgs.msg import String
6 import uuid
7 
8 if __name__ == "__main__":
9  rospy.init_node("fake_uuid")
10 
11  pub = rospy.Publisher("uuid", String, queue_size=1)
12  publish_rate = rospy.get_param("~publish_rate", 1)
13 
14  loop_rate = rospy.Rate(publish_rate)
15  uuid_msg = str(uuid.uuid4())
16  while not rospy.is_shutdown():
17  pub.publish(uuid_msg)
18  loop_rate.sleep()


amr_interop_bridge
Author(s):
autogenerated on Tue Mar 1 2022 23:45:33