Go to the documentation of this file.00001
00002 import roslib
00003 roslib.load_manifest('srs_assisted_detection')
00004
00005
00006 import rospy
00007
00008 from cob_object_detection_msgs.msg import *
00009 from srs_assisted_detection.srv import *
00010 from std_msgs.msg import *
00011
00012
00013
00014 def user_msg():
00015 rospy.wait_for_service('assisted_detection')
00016 string=String()
00017 string.data='junk'
00018 try:
00019 add_two_ints = rospy.ServiceProxy('assisted_detection', UiDetector)
00020 rospy.loginfo("client")
00021 resp1 = add_two_ints(string)
00022 print resp1
00023 except rospy.ServiceException, e:
00024 print "Service call failed: %s"%e
00025
00026
00027 if __name__ == "__main__":
00028 user_msg()