Go to the documentation of this file. 3 from __future__
import print_function
6 from std_msgs.msg
import String
9 rospy.init_node(
'test_node')
11 pub = rospy.Publisher(
'~output', String, queue_size=10)
14 print(
"Test node got", repr(data))
15 pub.publish(data.data)
17 sub = rospy.Subscriber(
'~input', String, callback)
rosmon_core
Author(s): Max Schwarz
autogenerated on Sat Jan 9 2021 03:35:43