Go to the documentation of this file.00001
00002
00003 import roslib; roslib.load_manifest("sr_move_arm")
00004 import rospy
00005 import actionlib
00006
00007 from arm_navigation_msgs.msg import *
00008
00009 if __name__ == '__main__':
00010 rospy.init_node('sr_move_arm_client')
00011 client = actionlib.SimpleActionClient('/right_arm/move_arm', MoveArmAction)
00012 client.wait_for_server()
00013
00014 goal = MoveArmGoal()
00015 client.send_goal(goal)
00016 client.wait_for_result()
00017 print client