mirror of
https://github.com/bulletphysics/bullet3
synced 2024-12-13 21:30:09 +00:00
6afa0a463d
add cube_convex.urdf for testing this collisionMargin. Test script: import pybullet as p import time p.connect(p.GUI) plane = p.loadURDF("plane_implicit.urdf") cube = p.loadURDF("cube_convex.urdf",[0,0,1]) p.setGravity(0,0,-10) while (1): p.stepSimulation() pts = p.getContactPoints() p.changeDynamics(plane,-1,collisionMargin=0.3) p.changeDynamics(cube,-1,collisionMargin=0.3) print("===================") print("cube pos=", p.getBasePositionAndOrientation(cube)[0]) print("margin=", p.getDynamicsInfo(plane,-1)[11]) #time.sleep(1./10.) |
||
---|---|---|
.. | ||
examples | ||
gym | ||
notebooks | ||
numpy | ||
tensorflow | ||
unittests | ||
unity3d | ||
CMakeLists.txt | ||
premake4.lua | ||
pybullet.c |