Isaac Sim Version
4.5.0
4.2.0
4.1.0
4.0.0
4.5.0
2023.1.1
2023.1.0-hotfix.1
Other (please specify):
Operating System
Ubuntu 22.04
Ubuntu 20.04
Windows 11
Windows 10
Other (please specify): 24.04
GPU Information
- Model: GeForce RTX 4090
- Driver Version: 550.144.03
CUDA: 12.4
What I’m Trying to Achieve
My URDF defines a revolute joint with a tilted axis, like this:
<link name="link1">
<inertial>
<mass value="3.4086" />
<origin xyz="0.00647 0.002071 0.000525" />
<inertia ixx="0.00784" ixy="-4.3e-05" ixz="-8e-06" iyy="0.005399" iyz="5.7e-05" izz="0.005556" />
</inertial>
<visual>
<geometry>
<mesh filename="link1.STL" />
</geometry>
</visual>
<collision>
<geometry>
<cylinder length="0.05" radius="0.03" />
</geometry>
</collision>
</link>
<joint name="JOINT_1" type="revolute">
<parent link="link0" />
<child link="link1" />
<origin xyz="0 -0.1492 -0.04" />
<axis xyz="0 0.966 0.259" />
</joint>
This joint connects the robot’s pelvis to a leg, and I want link1 to rotate around a tilted axis (mostly Y, slightly +Z), as shown:
Y
| * Axis: (0, 0.966, 0.259)
| /
| / link1 (rotates around this axis)
| /
| /
|/
O------ X
link0
through urdf importer, I got usda file like below.
def PhysicsRevoluteJoint "JOINT_1" (
apiSchemas = ["PhysicsJointStateAPI:angular", "PhysxJointAPI", "PhysicsDriveAPI:angular"]
)
{
float drive:angular:physics:maxForce = 270
uniform token drive:angular:physics:type = "force"
uniform token physics:axis = ""
rel physics:body0 = </World/robot/link0>
rel physics:body1 = </World/robot/link1>
float physics:JointEquivalentInertia = 0.2251985
point3f physics:localPos0 = (0, -0.1492, -0.04)
point3f physics:localPos1 = (0, 0, 0)
quatf physics:localRot0 = (0.70710677, 0, -0.18311895, 0.68298423)
quatf physics:localRot1 = (0.70710677, 0, -0.18311895, 0.68298423)
...
}
Issues
- UI Issue: Isaac Sim 4.5.0’s “Property” panel shows axis as “X”. but it’s not for real robot. Is this a UI bug?
- Motion Issue: The leg (link1) moves unexpectedly in -y and -x directions when rotating. Is this due to physics:axis, localRot0/localRot1, or something else?
- vector3f Support: Does PhysicsRevoluteJoint in 4.5.0 support vector3f for tilted axes? The schema mentions allowedTokens = [“X”, “Y”, “Z”] for uniform token, but is vector3f valid?
vector3f physics:axis = (0, 0.966, 0.259)
Questions
- Is vector3f supported for physics:axis in PhysicsRevoluteJoint (Isaac Sim 4.5.0)? Any best practices?
- Why does the UI show “X” instead of the vector3f value? Is this a known issue?
- Are there example USD files with tilted axes?