bulletphysics / bullet3

Bullet Physics SDK: real-time collision detection and multi-physics simulation for VR, games, visual effects, robotics, machine learning etc.
http://bulletphysics.org
Other
12.49k stars 2.87k forks source link

reduced_deformable_cube.py doesn't work #4625

Open yuki-sato109 opened 3 months ago

yuki-sato109 commented 3 months ago

I executed the following code, but it didn't work as expected. The code is from GitHub. What could be the cause? ` import pybullet as p from time import sleep import pybullet_data

physicsClient = p.connect(p.GUI)

p.setAdditionalSearchPath(pybullet_data.getDataPath())

p.resetSimulation(p.RESET_USE_REDUCED_DEFORMABLE_WORLD) p.resetDebugVisualizerCamera(4,-40,-30,[0, 0, 0]) p.setGravity(0, 0, -10)

tex = p.loadTexture("uvmap.png") planeId = p.loadURDF("plane.urdf", [0,0,-2])

boxId = p.loadURDF("cube.urdf", [1,1,5],useMaximalCoordinates = True) cube = p.loadURDF("reduced_cube/reduced_cube.urdf", [1,1,1])

p.changeVisualShape(cube, -1, rgbaColor=[1,1,1,1], textureUniqueId=tex, flags=0) p.setPhysicsEngineParameter(sparseSdfVoxelSize=0.25) p.setRealTimeSimulation(0)

while p.isConnected(): p.stepSimulation() p.getCameraImage(320,200) p.setGravity(0,0,-10) `

The error is shown below the code.

` b3Printf: URDF file 'reduced_cube/reduced_cube.urdf' not found

Traceback (most recent call last): File "/home/ericlab/デスクトップ/sato/cloth-penetration-example/reduced_cube.py", line 19, in cube = p.loadURDF("reduced_cube/reduced_cube.urdf", [1,1,1]) pybullet.error: Cannot load URDF file. `