Go to the documentation of this file. 4 from std_msgs.msg
import String
7 rospy.init_node(
'test_node')
9 pub = rospy.Publisher(
'~output', String, queue_size=10)
12 print "Test node got", repr(data)
13 pub.publish(data.data)
15 sub = rospy.Subscriber(
'~input', String, callback)
rosmon_core
Author(s): Max Schwarz
autogenerated on Wed Jul 10 2019 03:10:12