Skip to content

Commit b752c8a

Browse files
committed
make imarker work in multi_arm_sim, for just the first arm
1 parent 0339c51 commit b752c8a

File tree

2 files changed

+51
-0
lines changed

2 files changed

+51
-0
lines changed

src/moveit_pro_ur_configs/multi_arm_sim/config/moveit/multi_arm_ur.srdf

Lines changed: 4 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -28,6 +28,7 @@
2828
<group name="fourth_manipulator"/>
2929
</group>
3030
<group name="gripper">
31+
<link name="first_grasp_link"/>
3132
<joint name="first_robotiq_85_left_finger_tip_joint"/>
3233
<joint name="first_robotiq_85_left_inner_knuckle_joint"/>
3334
<joint name="first_robotiq_85_left_knuckle_joint"/>
@@ -36,6 +37,7 @@
3637
<joint name="first_robotiq_85_right_knuckle_joint"/>
3738
</group>
3839
<group name="second_gripper">
40+
<link name="second_grasp_link"/>
3941
<joint name="second_robotiq_85_left_finger_tip_joint"/>
4042
<joint name="second_robotiq_85_left_inner_knuckle_joint"/>
4143
<joint name="second_robotiq_85_left_knuckle_joint"/>
@@ -44,6 +46,7 @@
4446
<joint name="second_robotiq_85_right_knuckle_joint"/>
4547
</group>
4648
<group name="third_gripper">
49+
<link name="third_grasp_link"/>
4750
<joint name="third_robotiq_85_left_finger_tip_joint"/>
4851
<joint name="third_robotiq_85_left_inner_knuckle_joint"/>
4952
<joint name="third_robotiq_85_left_knuckle_joint"/>
@@ -52,6 +55,7 @@
5255
<joint name="third_robotiq_85_right_knuckle_joint"/>
5356
</group>
5457
<group name="fourth_gripper">
58+
<link name="fourth_grasp_link"/>
5559
<joint name="fourth_robotiq_85_left_finger_tip_joint"/>
5660
<joint name="fourth_robotiq_85_left_inner_knuckle_joint"/>
5761
<joint name="fourth_robotiq_85_left_knuckle_joint"/>
Lines changed: 47 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -0,0 +1,47 @@
1+
<?xml version="1.0" encoding="UTF-8" ?>
2+
<root BTCPP_format="4" main_tree_to_execute="Move to Pose">
3+
<BehaviorTree
4+
ID="Move to Pose"
5+
_description="Plan and execute motion to a Cartesian coordinate pose in a ROS message type, using inverse kinematics."
6+
>
7+
<Control ID="Sequence">
8+
<Action
9+
ID="InitializeMTCTask"
10+
task_id="move_to_pose"
11+
controller_names="{controller_names}"
12+
task="{move_to_pose_task}"
13+
/>
14+
<Action ID="SetupMTCCurrentState" task="{move_to_pose_task}" />
15+
<Action
16+
ID="SetupMTCPlanToPose"
17+
ik_frame="first_grasp_link"
18+
planning_group_name="first_manipulator"
19+
target_pose="{target_pose}"
20+
task="{move_to_pose_task}"
21+
/>
22+
<Action
23+
ID="PlanMTCTask"
24+
solution="{move_to_pose_solution}"
25+
task="{move_to_pose_task}"
26+
/>
27+
<SubTree
28+
ID="Wait for Trajectory Approval if User Available"
29+
solution="{move_to_pose_solution}"
30+
/>
31+
<Action ID="ExecuteMTCTask" solution="{move_to_pose_solution}" />
32+
</Control>
33+
</BehaviorTree>
34+
<TreeNodesModel>
35+
<SubTree ID="Move to Pose">
36+
<input_port name="target_pose" default="{target_pose}" />
37+
<input_port
38+
name="controller_names"
39+
default="/joint_trajectory_controller"
40+
/>
41+
<MetadataFields>
42+
<Metadata subcategory="Motion - Execute" />
43+
<Metadata runnable="false" />
44+
</MetadataFields>
45+
</SubTree>
46+
</TreeNodesModel>
47+
</root>

0 commit comments

Comments
 (0)