robot_description_loader.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 
00003 import rospy
00004 
00005 from std_msgs.msg import String
00006 rospy.init_node("robot_description_saver")
00007 
00008 def callback(msg):
00009     rospy.set_param("robot_description", msg.data)
00010 
00011 sub = rospy.Subscriber("robot_description", String, callback)
00012 
00013 rospy.spin()


jsk_data
Author(s):
autogenerated on Fri Sep 8 2017 03:39:16