mirror of
https://github.com/PotentiaRobotics/pybullet-resources.git
synced 2025-04-04 01:20:16 -04:00
20 lines
725 B
Python
20 lines
725 B
Python
import pybullet as p
|
|
import time
|
|
import pybullet_data
|
|
physicsClient = p.connect(p.GUI)#or p.DIRECT for non-graphical version
|
|
p.setAdditionalSearchPath(pybullet_data.getDataPath()) #optionally
|
|
p.setGravity(0,0,-10)
|
|
planeId = p.loadURDF("plane.urdf")
|
|
cubeStartPos = [0,0,0]
|
|
cubeStartOrientation = p.getQuaternionFromEuler([0,0,0])
|
|
robotId = p.loadURDF("olympian.urdf",cubeStartPos, cubeStartOrientation,
|
|
# useMaximalCoordinates=1, ## New feature in Pybullet
|
|
flags=p.URDF_USE_INERTIA_FROM_FILE)
|
|
for i in range (100000):
|
|
p.stepSimulation()
|
|
time.sleep(1./240.)
|
|
cubePos, cubeOrn = p.getBasePositionAndOrientation(robotId)
|
|
print(cubePos,cubeOrn)
|
|
p.disconnect()
|
|
|
|
|