fake_bb_user.py
Go to the documentation of this file.
00001 #!/usr/bin/python
00002 import roslib
00003 roslib.load_manifest('srs_assisted_detection')
00004 
00005 from array import *
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 from geometry_msgs.msg import *
00013 
00014 def user_msg():    
00015     rospy.wait_for_service('assisted_BBmove')
00016 
00017     try:
00018         add_two_ints = rospy.ServiceProxy('assisted_BBmove', BBMove)
00019         rospy.loginfo("client")
00020         pose=Pose()
00021         pose.position.x=0
00022         pose.position.y=0
00023         pose.position.z=0
00024 
00025         resp1 = add_two_ints(2,4,4,pose)
00026         rospy.loginfo(resp1)
00027     except rospy.ServiceException, e:
00028         print "Service call failed: %s"%e
00029     
00030     
00031 if __name__ == "__main__":
00032     user_msg()


srs_assisted_detection
Author(s): Heiko Hoennige
autogenerated on Mon Oct 6 2014 08:31:59