Skip to content
This repository has been archived by the owner on Dec 13, 2024. It is now read-only.

Commit

Permalink
update submodule
Browse files Browse the repository at this point in the history
Signed-off-by: Paul Gesel <paulgesel@gmail.com>
  • Loading branch information
pac48 committed Feb 22, 2024
1 parent 828203b commit 01d441f
Show file tree
Hide file tree
Showing 2 changed files with 61 additions and 1 deletion.
60 changes: 60 additions & 0 deletions src/picknik_ur_base_config/description/pinch_links.xacro
Original file line number Diff line number Diff line change
@@ -0,0 +1,60 @@
<?xml version="1.0" encoding="utf-8"?>
<robot xmlns:xacro="http://ros.org/wiki/xacro">
<!-- wrist_3_link/forearm_link have a radius 0f 0.0375m. Actual offset from surface is (radius - attached_link's radius). -->
<!-- UR Drivers check for a 2.5cm distance between tool_flange/wrist_3 and forearm links. -->
<xacro:macro name="forearm_pinch_link" params="prefix:='' length:=0.28 offset:=0.015">
<xacro:property name="prefix_" value='${prefix + "_" if prefix else ""}' />
<xacro:property name="radius" value='${0.0375 + offset}' />
<link name="${prefix_}forearm_pinch_link">
<visual>
<origin xyz="0 0 0" rpy="0 0 ${pi/16}"/>
<geometry>
<cylinder length="${length}" radius="${radius}"/>
</geometry>
<material name="silver">
<color rgba="0.75 0.65 0.65 0"/>
</material>
</visual>
<collision>
<origin xyz="0 0 0" rpy="0 0 ${pi/16}"/>
<geometry>
<cylinder length="${length}" radius="${radius}"/>
</geometry>
</collision>
</link>

<joint name="${prefix_}forearm_pinch_joint" type="fixed">
<parent link="${prefix_}forearm_link"/>
<child link="${prefix_}forearm_pinch_link"/>
<origin xyz="${-0.08 - length/2} 0 0.0049" rpy="0 ${pi/2} 0" />
</joint>
</xacro:macro>

<xacro:macro name="wrist_3_pinch_link" params="prefix:='' length:=0.11 offset:=0.012">
<xacro:property name="prefix_" value='${prefix + "_" if prefix else ""}' />
<xacro:property name="radius" value='${0.0375 + offset}' />
<link name="${prefix_}wrist_3_pinch_link">
<visual>
<origin xyz="0 0 0" rpy="0 0 0"/>
<geometry>
<cylinder length="${length}" radius="${radius}"/>
</geometry>
<material name="silver">
<color rgba="0.75 0.65 0.65 0"/>
</material>
</visual>
<collision>
<origin xyz="0 0 0" rpy="0 0 0"/>
<geometry>
<cylinder length="${length}" radius="${radius}"/>
</geometry>
</collision>
</link>

<joint name="${prefix_}wrist_3_pinch_joint" type="fixed">
<parent link="${prefix_}wrist_3_link"/>
<child link="${prefix_}wrist_3_pinch_link"/>
<origin xyz="0 0 0" rpy="0 0 ${pi/16}" />
</joint>
</xacro:macro>
</robot>

0 comments on commit 01d441f

Please sign in to comment.