summaryrefslogtreecommitdiff
path: root/examples/pybullet/examples/reduced_deformable_torus.py
diff options
context:
space:
mode:
authorerwincoumans <erwin.coumans@gmail.com>2022-03-07 15:38:32 -0800
committerGitHub <noreply@github.com>2022-03-07 15:38:32 -0800
commit3df6e1a72173340833e1e6ddd8b5cf1dc400e651 (patch)
tree1a17b7d5c292dfff62b5dee6e1056af7c6312fc4 /examples/pybullet/examples/reduced_deformable_torus.py
parenta8e1ce8273e102d3222954b151fe4067658df7d6 (diff)
downloadbullet3-revert-4069-master.tar.gz
Revert "Reduced Deformable Model"revert-4069-master
Diffstat (limited to 'examples/pybullet/examples/reduced_deformable_torus.py')
-rw-r--r--examples/pybullet/examples/reduced_deformable_torus.py32
1 files changed, 0 insertions, 32 deletions
diff --git a/examples/pybullet/examples/reduced_deformable_torus.py b/examples/pybullet/examples/reduced_deformable_torus.py
deleted file mode 100644
index 8f42e0372..000000000
--- a/examples/pybullet/examples/reduced_deformable_torus.py
+++ /dev/null
@@ -1,32 +0,0 @@
-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])
-
-box1 = p.loadURDF("cube.urdf", [1,1,3],useMaximalCoordinates = True)
-box2 = p.loadURDF("cube.urdf", [0,3,2],useMaximalCoordinates = True)
-
-# p.startStateLogging(p.STATE_LOGGING_VIDEO_MP4, "reduced_torus.mp4")
-reduced_obj1= p.loadURDF("reduced_torus/reduced_torus.urdf", [1,1,1])
-p.changeVisualShape(reduced_obj1, -1, rgbaColor=[1,1,1,1], textureUniqueId=tex, flags=0)
-
-reduced_obj2 = p.loadURDF("reduced_torus/reduced_torus.urdf", [1,2,1])
-p.changeVisualShape(reduced_obj2, -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)