Update test.py

This commit is contained in:
erwincoumans
2016-05-10 01:28:45 -07:00
parent 15ce069c04
commit 119d47166d

View File

@@ -2,10 +2,10 @@ import pybullet
import time
#choose connection method: GUI, DIRECT, SHARED_MEMORY
pybullet.connect(pybullet.GUI)
pybullet.connect(pybullet.SHARED_MEMORY)
#load URDF, given a relative or absolute file+path
obj = pybullet.loadURDF("r2d2.urdf",posX,posY,posZ)
obj = pybullet.loadURDF("r2d2.urdf")
posX=0
posY=3
@@ -32,4 +32,3 @@ pybullet.resetSimulation()
#disconnect from the physics server
pybullet.disconnect()