7 from smach
import State,StateMachine
14 from move_base_msgs.msg
import MoveBaseAction, MoveBaseGoal
18 import moveit_commander
19 import moveit_msgs.msg
20 from geometry_msgs.msg
import Pose, PoseStamped
21 import geometry_msgs.msg
23 from seed_r7_ros_controller.srv
import*
29 rospack = rospkg.RosPack()
31 path = rospack.get_path(
'seed_r7_samples')
32 with open(path +
'/config/waypoints.yaml')
as f:
36 while not self.
ac.wait_for_server(rospy.Duration(5)):
37 rospy.loginfo(
"Waiting for the move_base action server to come up")
38 rospy.loginfo(
"The server comes up");
44 rev = dict(self.
config[_number])
46 self.
goal.target_pose.header.frame_id =
'map' 47 self.
goal.target_pose.header.stamp = rospy.Time.now()
48 self.
goal.target_pose.pose.position.x = rev[
'pose'][
'position'][
'x']
49 self.
goal.target_pose.pose.position.y = rev[
'pose'][
'position'][
'y']
50 self.
goal.target_pose.pose.position.z = rev[
'pose'][
'position'][
'z']
51 self.
goal.target_pose.pose.orientation.x = rev[
'pose'][
'orientation'][
'x']
52 self.
goal.target_pose.pose.orientation.y = rev[
'pose'][
'orientation'][
'y']
53 self.
goal.target_pose.pose.orientation.z = rev[
'pose'][
'orientation'][
'z']
54 self.
goal.target_pose.pose.orientation.w = rev[
'pose'][
'orientation'][
'w']
56 rospy.loginfo(
'Sending goal')
57 self.
ac.send_goal(self.
goal)
58 succeeded = self.
ac.wait_for_result(rospy.Duration(60));
59 state = self.
ac.get_state();
61 rospy.loginfo(
"Succeed")
64 rospy.loginfo(
"Failed")
73 State.__init__(self, outcomes=[
'succeeded',
'aborted'])
77 rospy.loginfo(
'Going to Place{}'.format(self.
place_))
78 if(na.set_goal(self.
place_) ==
'succeeded'):
return 'succeeded' 79 else:
return 'aborted' 84 rospy.loginfo(
'waiting service')
85 rospy.wait_for_service(
'/seed_r7_ros_controller/hand_control')
89 service = rospy.ServiceProxy(
'/seed_r7_ros_controller/hand_control', HandControl)
90 response = service(0,
'grasp',100)
92 except rospy.ServiceException
as e:
93 rospy.logerr(
'Service call failed: {}'.format(e))
98 service = rospy.ServiceProxy(
'/seed_r7_ros_controller/hand_control', HandControl)
99 response = service(0,
'release',100)
101 except rospy.ServiceException
as e:
102 rospy.logerr(
'Service call failed: {}'.format(e))
108 self.
robot = moveit_commander.RobotCommander()
109 self.
scene = moveit_commander.PlanningSceneInterface()
111 self.
group = moveit_commander.MoveGroupCommander(
"rarm_with_torso")
112 self.
group.set_pose_reference_frame(
"base_link")
118 self.
robot_model = rospy.get_param(
"/seed_r7_ros_controller/robot_model_plugin")
121 self.
group = moveit_commander.MoveGroupCommander(
"rarm_with_torso")
122 self.
group.set_pose_reference_frame(
"base_link")
123 self.
group.set_planner_id(
"RRTConnectkConfigDefault" )
124 self.
group.allow_replanning(
True )
127 if(direction ==
"side"):
128 self.
group.set_end_effector_link(
"r_eef_grasp_link")
129 quat = tf.transformations.quaternion_from_euler(0,0,0)
130 elif(direction ==
"top"):
131 self.
group.set_end_effector_link(
"r_eef_pick_link")
132 quat = tf.transformations.quaternion_from_euler(-1.57,0.79,0)
134 target_pose.orientation.x = quat[0]
135 target_pose.orientation.y = quat[1]
136 target_pose.orientation.z = quat[2]
137 target_pose.orientation.w = quat[3]
139 target_pose.position.x = x
140 target_pose.position.y = y
141 target_pose.position.z = z
143 self.
group.set_pose_target(target_pose)
144 self.
group.set_max_velocity_scaling_factor(vel)
146 if type(plan)
is tuple:
149 if(len(plan.joint_trajectory.points)==0):
150 rospy.logwarn(
"IK can't be solved")
151 self.
group.clear_pose_targets()
154 self.
group.execute(plan)
158 self.
group = moveit_commander.MoveGroupCommander(
"torso")
159 self.
group.set_pose_reference_frame(
"base_link")
160 self.
group.set_end_effector_link(
"body_link")
162 distance_body_lifter = 1.065 - 0.92
164 distance_body_lifter = 0.994 - 0.857
168 target_pose.orientation.x = 0
169 target_pose.orientation.y = 0
170 target_pose.orientation.z = 0
171 target_pose.orientation.w = 1
173 target_pose.position.x = x
174 target_pose.position.y = 0
175 target_pose.position.z = z + distance_body_lifter
177 self.
group.set_start_state_to_current_state()
178 self.
group.set_pose_target(target_pose)
179 self.
group.set_max_velocity_scaling_factor(vel)
181 if type(plan)
is tuple:
184 if(len(plan.joint_trajectory.points)==0):
185 rospy.logwarn(
"can't be solved lifter ik")
186 self.
group.clear_pose_targets()
189 self.
group.execute(plan)
193 self.
group = moveit_commander.MoveGroupCommander(
"upper_body")
194 self.
group.set_named_target(
"reset-pose")
196 if type(plan)
is tuple:
200 if(len(plan.joint_trajectory.points)==0):
201 rospy.logwarn(
"IK can't be solved")
202 self.
group.clear_pose_targets()
205 self.
group.execute(plan)
211 start = rospy.get_time()
212 seconds = rospy.get_time()
213 while (seconds - start < timeout)
and not rospy.is_shutdown():
214 attached_objects = scene.get_attached_objects([box_name])
215 is_attached = len(attached_objects.keys()) > 0
217 is_known = box_name
in scene.get_known_object_names()
219 if (box_is_attached == is_attached)
and (box_is_known == is_known):
223 seconds = rospy.get_time()
228 box_pose = geometry_msgs.msg.PoseStamped()
229 box_pose.header.frame_id =
"base_link" 230 box_pose.pose.position.x = x
231 box_pose.pose.position.y = y
232 box_pose.pose.position.z = z
236 self.
scene.add_box(
"shelf1", self.
box_pose(0.8,0,0.3), size=(0.5, 1.0, 0.01))
237 self.
scene.add_box(
"shelf2", self.
box_pose(0.8,0,0.7), size=(0.5, 1.0, 0.01))
238 self.
scene.add_box(
"shelf3", self.
box_pose(0.8,0,1.1), size=(0.5, 1.0, 0.01))
240 self.
scene.add_box(
"wall1", self.
box_pose(0.8,0.5,0.75), size=(0.5, 0.01, 1.5))
241 self.
scene.add_box(
"wall2", self.
box_pose(0.8,-0.5,0.75), size=(0.5, 0.01, 1.5))
243 self.
scene.add_box(
"box1", self.
box1, size=(0.05, 0.1, 0.1))
244 self.
scene.add_box(
"box2", self.
box2, size=(0.05, 0.05, 0.1))
245 self.
scene.add_box(
"box3", self.
box3, size=(0.05, 0.05, 0.1))
250 self.
scene.remove_world_object()
254 self.
group.set_end_effector_link(
"r_eef_pick_link")
255 eef_link = self.
group.get_end_effector_link()
256 grasping_group =
'rhand' 257 touch_links = self.
robot.get_link_names(group=grasping_group)
258 self.
scene.attach_box(eef_link, object_name, touch_links=touch_links)
263 self.
group.set_end_effector_link(
"r_eef_pick_link")
264 eef_link = self.
group.get_end_effector_link()
266 self.
scene.remove_attached_object(eef_link, name=object_name)
273 State.__init__(self, outcomes=[
'succeeded',
'aborted'])
281 rospy.loginfo(
'Manipulate at ({},{},{}) in scale velocity {}'.format(self.
x,self.
y,self.
z,self.
vel))
283 ==
'succeeded'):
return 'succeeded' 284 else:
return 'aborted' 289 State.__init__(self, outcomes=[
'succeeded',
'aborted'])
295 rospy.loginfo(
'Move Lifter at ({},{}) in scale velocity {}'.format(self.
x,self.
z,self.
vel))
296 if(mc.set_lifter_position(self.
x,self.
z,self.
vel) ==
'succeeded'):
return 'succeeded' 297 else:
return 'aborted' 302 State.__init__(self, outcomes=[
'succeeded',
'aborted'])
305 rospy.loginfo(
'initialize wholebody')
307 if(mc.set_initial_pose() ==
'succeeded'):
return 'succeeded' 308 else:
return 'aborted' 312 State.__init__(self, outcomes=[
'succeeded',
'aborted'])
318 if(mc.add_objects() ==
'succeeded'):
return 'succeeded' 319 else:
return 'aborted' 320 elif(self.
action ==
'remove'):
321 print(
'remove objects')
322 if(mc.remove_objects() ==
'succeeded'):
return 'succeeded' 323 else:
return 'aborted' 327 State.__init__(self, outcomes=[
'succeeded',
'aborted'])
331 if(mc.attach_objects(self.
object_name) ==
'succeeded'):
332 if(hc.grasp()):
return 'succeeded' 333 else:
return 'aborted' 334 else:
return 'aborted' 338 State.__init__(self, outcomes=[
'succeeded',
'aborted'])
342 if(mc.detach_objects(self.
object_name) ==
'succeeded'):
343 if(hc.release()):
return 'succeeded' 344 else:
return 'aborted' 345 else:
return 'aborted' 349 if __name__ ==
'__main__':
350 rospy.init_node(
'scenario_node')
356 go_to_shelf = StateMachine(outcomes=[
'succeeded',
'aborted'])
358 StateMachine.add(
'DOWN LIFTER',
MOVE_LIFTER(0,0.6),\
359 transitions={
'succeeded':
'MOVE',
'aborted':
'aborted'})
361 transitions={
'succeeded':
'succeeded',
'aborted':
'aborted'})
363 go_to_start_point = StateMachine(outcomes=[
'succeeded',
'aborted'])
364 with go_to_start_point:
365 StateMachine.add(
'DOWN LIFTER',
MOVE_LIFTER(0,0.6),\
366 transitions={
'succeeded':
'MOVE',
'aborted':
'aborted'})
368 transitions={
'succeeded':
'succeeded',
'aborted':
'aborted'})
370 pick_place_1 = StateMachine(outcomes=[
'succeeded',
'aborted'])
371 x = mc.box1.pose.position.x
372 y = mc.box1.pose.position.y
373 z = mc.box1.pose.position.z
375 StateMachine.add(
'PICK MOTION',
MANIPULATE(x, y, z, direction=
"top"), \
376 transitions={
'succeeded':
'PICK',
'aborted':
'aborted'})
377 StateMachine.add(
'PICK',
PICK(
'box1'),\
378 transitions={
'succeeded':
'PLACE MOTION',
'aborted':
'aborted'})
379 StateMachine.add(
'PLACE MOTION',
MANIPULATE(0.6, -0.4, z + 0.4, direction=
"top"), \
380 transitions={
'succeeded':
'PLACE',
'aborted':
'aborted'})
381 StateMachine.add(
'PLACE',
PLACE(
'box1'),\
382 transitions={
'succeeded':
'succeeded',
'aborted':
'aborted'})
384 pick_place_2 = StateMachine(outcomes=[
'succeeded',
'aborted'])
385 x = mc.box2.pose.position.x
386 y = mc.box2.pose.position.y
387 z = mc.box2.pose.position.z
389 StateMachine.add(
'PICK MOTION',
MANIPULATE(x, y, z), \
390 transitions={
'succeeded':
'PICK',
'aborted':
'aborted'})
391 StateMachine.add(
'PICK',
PICK(
'box2'),\
392 transitions={
'succeeded':
'PLACE MOTION',
'aborted':
'aborted'})
393 StateMachine.add(
'PLACE MOTION',
MANIPULATE(0.6, -0.2, z), \
394 transitions={
'succeeded':
'PLACE',
'aborted':
'aborted'})
395 StateMachine.add(
'PLACE',
PLACE(
'box2'),\
396 transitions={
'succeeded':
'succeeded',
'aborted':
'aborted'})
398 pick_place_3 = StateMachine(outcomes=[
'succeeded',
'aborted'])
399 x = mc.box3.pose.position.x
400 y = mc.box3.pose.position.y
401 z = mc.box3.pose.position.z
403 StateMachine.add(
'PICK MOTION',
MANIPULATE(x, y, z), \
404 transitions={
'succeeded':
'PICK',
'aborted':
'aborted'})
405 StateMachine.add(
'PICK',
PICK(
'box3'),\
406 transitions={
'succeeded':
'PLACE MOTION',
'aborted':
'aborted'})
407 StateMachine.add(
'PLACE MOTION',
MANIPULATE(0.6, 0.0, z - 0.4), \
408 transitions={
'succeeded':
'PLACE',
'aborted':
'aborted'})
409 StateMachine.add(
'PLACE',
PLACE(
'box3'),\
410 transitions={
'succeeded':
'succeeded',
'aborted':
'aborted'})
412 scenario_play = StateMachine(outcomes=[
'succeeded',
'aborted'])
414 StateMachine.add(
'GO TO SHELF', go_to_shelf,\
415 transitions={
'succeeded':
'ADD OBJECTS',
'aborted':
'aborted'})
417 transitions={
'succeeded':
'PICK and PLACE 1',
'aborted':
'aborted'})
418 StateMachine.add(
'PICK and PLACE 1', pick_place_1,\
419 transitions={
'succeeded':
'PICK and PLACE 2',
'aborted':
'aborted'})
420 StateMachine.add(
'PICK and PLACE 2', pick_place_2,\
421 transitions={
'succeeded':
'PICK and PLACE 3',
'aborted':
'aborted'})
422 StateMachine.add(
'PICK and PLACE 3', pick_place_3,\
423 transitions={
'succeeded':
'INITIALIZE',
'aborted':
'aborted'})
424 StateMachine.add(
'INITIALIZE',
INIT_POSE(),\
425 transitions={
'succeeded':
'REMOVE OBJECTS',
'aborted':
'aborted'})
427 transitions={
'succeeded':
'GO TO START POINT',
'aborted':
'aborted'})
428 StateMachine.add(
'GO TO START POINT', go_to_start_point,\
429 transitions={
'succeeded':
'GO TO SHELF',
'aborted':
'aborted'})
431 sis = smach_ros.IntrospectionServer(
'server_name',scenario_play,
'/SEED-Noid-Mover Scenario Play')
433 scenario_play.execute()
def set_grasp_position(self, x, y, z, vel=1.0, direction="side")
def __init__(self, _place)
def execute(self, userdata)
def execute(self, userdata)
def execute(self, userdata)
def execute(self, userdata)
def set_lifter_position(self, x, z, vel=1.0)
def detach_objects(self, object_name)
def __init__(self, object_name)
def box_pose(self, x, y, z)
def __init__(self, object_name)
def execute(self, userdata)
def __init__(self, x, z, vel=1.0)
def __init__(self, action)
def attach_objects(self, object_name)
def set_initial_pose(self)
def set_goal(self, _number)
def execute(self, userdata)
def execute(self, userdata)
def __init__(self, x, y, z, vel=1.0, direction="side")
def wait_for_state_update(self, box_name, box_is_known=False, box_is_attached=False, timeout=4)