robot_description_loader.py
Go to the documentation of this file.
1 #!/usr/bin/env python
2 
3 import rospy
4 
5 from std_msgs.msg import String
6 rospy.init_node("robot_description_saver")
7 
8 def callback(msg):
9  rospy.set_param("robot_description", msg.data)
10 
11 sub = rospy.Subscriber("robot_description", String, callback)
12 
13 rospy.spin()


jsk_data
Author(s):
autogenerated on Tue Feb 6 2018 03:45:36