Go to the documentation of this file.00001
00002
00003 import sys
00004 import rospy
00005 from retalis.srv import *
00006
00007 def add(X):
00008 rospy.wait_for_service('subscribe_output')
00009 try:
00010 add_two_ints = rospy.ServiceProxy('subscribe_output', SubscribeOutput)
00011 resp1 = add_two_ints('geometry_msgs__0__PoseStamped(std_msgs__0__Header(_,_,X),_)','X="4x4_1"',"_","marker","m2")
00012 print resp1.result
00013 return
00014 except rospy.ServiceException, e:
00015 print "Service call failed: %s"%e
00016
00017
00018 if __name__ == "__main__":
00019 add(1)
00020