mirror of
https://github.com/bulletphysics/bullet3
synced 2024-12-14 22:00:05 +00:00
cfd35840f0
see examples/pybullet/logMinitaur.py for example. Other state logging will include general robot states and VR controllers state.
16 lines
367 B
Python
16 lines
367 B
Python
import pybullet as p
|
|
cid = p.connect(p.SHARED_MEMORY)
|
|
if (cid < 0) :
|
|
p.connect(p.GUI)
|
|
p.loadURDF("plane.urdf")
|
|
|
|
quadruped = p.loadURDF("quadruped/quadruped.urdf")
|
|
logId = p.startStateLogging(p.STATE_LOGGING_MINITAUR,"LOG00048.TXT",[quadruped])
|
|
p.stepSimulation()
|
|
p.stepSimulation()
|
|
p.stepSimulation()
|
|
p.stepSimulation()
|
|
p.stepSimulation()
|
|
|
|
p.stopStateLogging(logId)
|