bullet3 icon indicating copy to clipboard operation
bullet3 copied to clipboard

reduced_deformable_cube.py doesn't work

Open yuki-sato109 opened this issue 3 weeks ago • 0 comments

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. `

yuki-sato109 avatar Jun 10 '24 03:06 yuki-sato109