mirror of
https://github.com/bulletphysics/bullet3
synced 2024-12-16 06:30:05 +00:00
4897139dad
add inverse_kinematics.py and hello_pybullet.py pybullet examples add m_worldLinkFramePosition/Orientation fields to b3LinkState, and in pybullet.getLinkState (URDF link frame in Cartesian/world coordinates)
23 lines
548 B
Python
23 lines
548 B
Python
import pybullet as p
|
|
from time import sleep
|
|
|
|
physicsClient = p.connect(p.GUI)
|
|
|
|
p.setGravity(0,0,-10)
|
|
planeId = p.loadURDF("plane.urdf")
|
|
cubeStartPos = [0,0,1]
|
|
cubeStartOrientation = p.getQuaternionFromEuler([0,0,0])
|
|
boxId = p.loadURDF("r2d2.urdf",cubeStartPos, cubeStartOrientation)
|
|
cubePos, cubeOrn = p.getBasePositionAndOrientation(boxId)
|
|
|
|
useRealTimeSimulation = 0
|
|
|
|
if (useRealTimeSimulation):
|
|
p.setRealTimeSimulation(1)
|
|
|
|
while 1:
|
|
if (useRealTimeSimulation):
|
|
p.setGravity(0,0,-10)
|
|
sleep(0.01) # Time in seconds.
|
|
else:
|
|
p.stepSimulation() |