Go to the documentation of this file.00001
00002 import roslib; roslib.load_manifest('iri_deformable_analysis')
00003
00004 import rospy
00005 from geometry_msgs.msg import Pose
00006
00007 topic_name = 'deformable_best_pose';
00008 test_pose = Pose()
00009
00010 rospy.init_node('test_pose')
00011 pub = rospy.Publisher(topic_name, Pose)
00012 num = pub.get_num_connections()
00013 while not rospy.is_shutdown() and pub.get_num_connections() == num:
00014 pass
00015
00016 pub.publish(test_pose)
00017
00018 print "Pose published on " + topic_name