publish_config.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 import sys
3 import rospy
4 import std_msgs.msg as sm
5 
6 rospy.init_node('example')
7 with open(sys.argv[1]) as f:
8  data = sm.String(data=f.read())
9  pub = rospy.Publisher('/ez_interactive_marker/update_config',
10  sm.String, queue_size=1, latch=True)
11  pub.publish(data)
12 rospy.sleep(5.0)


ez_interactive_marker
Author(s):
autogenerated on Mon Jun 10 2019 13:15:06