summaryrefslogtreecommitdiff
path: root/examples/pybullet/examples/loadingBench.py
diff options
context:
space:
mode:
Diffstat (limited to 'examples/pybullet/examples/loadingBench.py')
-rw-r--r--examples/pybullet/examples/loadingBench.py52
1 files changed, 26 insertions, 26 deletions
diff --git a/examples/pybullet/examples/loadingBench.py b/examples/pybullet/examples/loadingBench.py
index 38a12e12d..fcd886df5 100644
--- a/examples/pybullet/examples/loadingBench.py
+++ b/examples/pybullet/examples/loadingBench.py
@@ -1,26 +1,26 @@
-import pybullet as p
-import time
-p.connect(p.GUI)
-
-p.resetSimulation()
-timinglog = p.startStateLogging(p.STATE_LOGGING_PROFILE_TIMINGS, "loadingBenchVR.json")
-p.configureDebugVisualizer(p.COV_ENABLE_RENDERING, 0)
-print("load plane.urdf")
-p.loadURDF("plane.urdf")
-print("load r2d2.urdf")
-
-p.loadURDF("r2d2.urdf", 0, 0, 1)
-print("load kitchen/1.sdf")
-p.loadSDF("kitchens/1.sdf")
-print("load 100 times plate.urdf")
-for i in range(100):
- p.loadURDF("dinnerware/plate.urdf", 0, i, 1)
-
-p.configureDebugVisualizer(p.COV_ENABLE_RENDERING, 1)
-
-p.stopStateLogging(timinglog)
-print("stopped state logging")
-p.getCameraImage(320, 200)
-
-while (1):
- p.stepSimulation()
+import pybullet as p
+import time
+p.connect(p.GUI)
+
+p.resetSimulation()
+timinglog = p.startStateLogging(p.STATE_LOGGING_PROFILE_TIMINGS, "loadingBenchVR.json")
+p.configureDebugVisualizer(p.COV_ENABLE_RENDERING, 0)
+print("load plane.urdf")
+p.loadURDF("plane.urdf")
+print("load r2d2.urdf")
+
+p.loadURDF("r2d2.urdf", 0, 0, 1)
+print("load kitchen/1.sdf")
+p.loadSDF("kitchens/1.sdf")
+print("load 100 times plate.urdf")
+for i in range(100):
+ p.loadURDF("dinnerware/plate.urdf", 0, i, 1)
+
+p.configureDebugVisualizer(p.COV_ENABLE_RENDERING, 1)
+
+p.stopStateLogging(timinglog)
+print("stopped state logging")
+p.getCameraImage(320, 200)
+
+while (1):
+ p.stepSimulation()