Go to the documentation of this file. 5 from std_msgs.msg
import String
6 rospy.init_node(
"robot_description_saver")
9 rospy.set_param(
"robot_description", msg.data)
11 sub = rospy.Subscriber(
"robot_description", String, callback)
jsk_data
Author(s):
autogenerated on Tue Feb 6 2018 03:45:36