pickup.py
Go to the documentation of this file.
00001 #!/usr/bin/env python
00002 
00003 import roslib; roslib.load_manifest('estirabot_apps')
00004 import rospy
00005 import smach
00006 import smach_ros
00007 
00008 from object_manipulation_msgs.msg import Grasp, PickupGoal
00009 
00010 # Build a PickupGoal message from a given pose
00011 def build_simple_pickup_goal(grasp_joint_state, pre_grasp_joint_state, fingers_config):
00012     # Adjust finger config un param server
00013     rospy.set_param('/estirabot/skills/grasp/fingers_configuration', fingers_config)
00014 
00015     g = Grasp()
00016     g.grasp_posture     = grasp_joint_state
00017     g.pre_grasp_posture = pre_grasp_joint_state
00018 
00019     r = PickupGoal()
00020     r.desired_grasps.append(g)
00021 
00022     return r


estirabot_apps_base
Author(s): Jose Luis Rivero
autogenerated on Fri Dec 6 2013 21:07:07