.. |
data
|
print better error warning, in case the physics client/server version mismatch.
|
2017-05-28 17:05:18 -07:00 |
addPlanarReflection.py
|
PyBullet: add planar reflection example,
|
2018-04-11 01:03:36 -07:00 |
batchRayCast.py
|
PyBullet: allow to replace existing debug lines in addUserDebugLine through the replaceItemUniqueId argument
|
2018-06-22 16:47:20 -07:00 |
biped2d_pybullet.py
|
PyBullet: added preliminary DART and MuJoCo backend files, MuJoCo can loadMJCF, stepSimulation and getBasePositionAndOrientation, DART is empty.
|
2018-07-01 14:42:32 -07:00 |
changeTexture.py
|
implement pybullet.changeTexture. For now, the width/height has to match the target texture unique id, otherwise crashes may happen (a check for width/height match will be added)
|
2017-06-30 19:11:43 -07:00 |
commandLogAndPlayback.py
|
PyBullet: expose STATE_LOGGING_ALL_COMMANDS and STATE_REPLAY_ALL_COMMANDS
|
2018-06-12 16:56:45 -07:00 |
constraint.py
|
Add API to get user constraint id.
|
2017-05-03 18:25:25 -07:00 |
createMultiBodyLinks.py
|
Allow to create concave collision meshes. Note that this is only supported for static (mass 0) multibodies.
|
2017-06-23 14:43:28 -07:00 |
createObstacleCourse.py
|
add 'createObstacleCourse.py' example, helps reproducing
|
2017-07-29 13:18:49 +02:00 |
createSphereMultiBodies.py
|
Allow to create concave collision meshes. Note that this is only supported for static (mass 0) multibodies.
|
2017-06-23 14:43:28 -07:00 |
createVisualShape.py
|
PyBullet: add planar reflection example,
|
2018-04-11 01:03:36 -07:00 |
createVisualShapeArray.py
|
PyBullet/C-API: implement createVisualShapeArray, with multiple visual shapes (require 1 texture max, since visual shapes are merged)
|
2018-03-09 18:02:06 -08:00 |
debugDrawItems.py
|
fix pybullet.addUserDebugText borders around letters
|
2017-10-10 22:11:32 -07:00 |
dumpLog.py
|
fix dumpLog.py
|
2017-09-06 14:34:10 -07:00 |
dumpVrLog.py
|
keep the original dumpLog, and create a dumpVrLog
|
2017-05-10 16:12:45 -07:00 |
experimentalCcdSphereRadius.py
|
PyBullet: expose internal edge utility, to adjust edge normals to prevent object penetrating along triangle edges of concave triangle meshes
|
2018-02-16 19:44:33 -08:00 |
externalTorqueControlledSphere.py
|
add example of a free moving sphere controlled by external torque
|
2018-04-01 15:55:32 -07:00 |
forcetorquesensor.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
frictionCone.py
|
expose pybullet 'enableConeFriction' to switch between pyramid and cone friction model.
|
2017-12-01 10:07:07 -08:00 |
getAABB.py
|
fix getAABB.py on mac osx
|
2017-09-11 19:46:54 -07:00 |
getTextureUid.py
|
expose texture unique id after loading URD file, so you can restore to the original texture after changing it to a custom texture. See also getTextureUid.py example.
|
2018-07-08 11:23:12 +02:00 |
hand.ino
|
change hand.ino/py to match hardware changes (use pullup resistor, connect to gnd, instead of 5V + pull down resistor)
|
2017-04-24 09:56:27 -07:00 |
hand.py
|
add option to calibrate individual fingers for the vr glove
|
2017-04-25 09:40:18 -07:00 |
hello_pybullet.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
humanoid_benchmark.py
|
fix getAABB.py on mac osx
|
2017-09-11 19:46:54 -07:00 |
humanoid_knee_position_control.py
|
remove pose frame from SDF,
|
2017-06-01 20:13:39 -07:00 |
humanoid_manual_control.py
|
tweak ImportMJCFSetup.cpp example MJCF humanoid a bit, clamp target positions to be within joint limits to avoid solver problems (conflicting constraints)
|
2018-01-04 13:14:11 -08:00 |
ik_end_effector_orientation.py
|
Modify the link index when computing Jacobian. Add a test for end effector orientation IK. Inverse dynamics Jacobian uses zero-based indexing of bodies, not starting from -1 for base.
|
2017-04-17 16:54:45 -07:00 |
integrate.py
|
add integrate.py example
|
2017-10-27 18:26:32 -07:00 |
internalEdge.py
|
PyBullet: expose internal edge utility, to adjust edge normals to prevent object penetrating along triangle edges of concave triangle meshes
|
2018-02-16 19:44:33 -08:00 |
inverse_dynamics.py
|
allow IK on a floating base, see video:
|
2017-10-25 00:32:47 -07:00 |
inverse_kinematics_husky_kuka.py
|
allow IK on a floating base, see video:
|
2017-10-25 00:32:47 -07:00 |
inverse_kinematics_pole.py
|
Add inverse kinematics example for pole, which has a prismatic joint.
|
2017-10-19 14:30:37 -07:00 |
inverse_kinematics.py
|
implement accurate inverse kinematics in C++. PyBullet.calculateInverseKinematics gets "maxNumIterations=20", "residualThreshold=1.04" to tune
|
2018-05-31 16:06:15 -07:00 |
jacobian.py
|
Fix jacobian computation
|
2018-03-26 18:40:42 +09:00 |
jointFrictionAndMotor.py
|
example of joint motor with friction
|
2018-01-06 13:43:07 -08:00 |
jointFrictionDamping.py
|
add jointFrictionDamping.py example
|
2017-10-23 12:25:04 -07:00 |
kuka_grasp_block_playback.py
|
print better error warning, in case the physics client/server version mismatch.
|
2017-05-28 17:05:18 -07:00 |
kuka_with_cube_playback.py
|
Remove debug code.
|
2017-06-02 17:40:50 -07:00 |
kuka_with_cube.py
|
add nicer meshes to kuka_with_gripper.sdf and add kuka_with_gripper2.sdf that can rotate without messing up IK
|
2017-06-14 19:34:33 -07:00 |
load_soft_body.py
|
PyBullet: soft bodies are rendered, so we don't need to also render wireframes in regular mode.
|
2018-02-18 11:09:42 -08:00 |
loadingBench.py
|
add example of faster URDF/SDF loading in VR/GUI mode,
|
2017-07-14 23:32:53 +01:00 |
logMinitaur.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
manyspheres.py
|
fix saveRestoreState.py example
|
2018-06-15 08:31:39 -07:00 |
mimicJointConstraint.py
|
tweak pybullet examples a bit (mac OSX OpenGL runs in mainloop, with python interpreter,
|
2017-09-24 21:37:31 -07:00 |
minitaur_evaluate.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
minitaur_test.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
minitaur.py
|
make the URDF and the minitaur.py consistent with the real robot
|
2017-04-05 11:54:54 -07:00 |
motorMaxVelocity.py
|
expose a maximum velocity due to the joint motor in position control.
|
2017-11-21 17:05:28 -08:00 |
mylittleminitaur.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
otherPhysicsEngine.py
|
PyBullet: add example to enable another physics engine backend (DART, MuJoCo)
|
2018-07-01 14:49:34 -07:00 |
pdControl.py
|
Add the pdControlPlugin to the joint control C API, and add the PD control mode (also available in pybullet). Modify the pdControl pybullet example to use the PD control mode with setJointMotorControl API.
|
2018-06-15 17:59:26 -07:00 |
pointCloudFromCameraImage.py
|
example for Issue #1586
|
2018-03-10 19:49:30 -08:00 |
profileTiming.py
|
Improve ChromeTraceUtil logging, allow filename to be specified.
|
2017-05-04 17:51:40 -07:00 |
projective_texture.py
|
expose texture unique id after loading URD file, so you can restore to the original texture after changing it to a custom texture. See also getTextureUid.py example.
|
2018-07-08 11:23:12 +02:00 |
quadruped_playback.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
quadruped_setup_playback.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
quadruped.py
|
allow to use colors from MJCF file as option (default to random Google colors), use p.loadMJCF(filename, flags=p.URDF_MJCF_COLORS_FROM_FILE
|
2018-01-11 21:04:08 -08:00 |
racecar_differential.py
|
allow auxilary link to be used for gear btMultiBodyGearConstraint.
|
2017-06-23 20:24:04 -07:00 |
racecar.py
|
more fixes in pybullet_gym envs/data.
|
2017-08-27 19:34:00 -07:00 |
renderPlugin.py
|
PyBullet / BulletRobotics: prepare for pdControlPlugin and collisionFilterPlugin
|
2018-06-05 11:41:41 +10:00 |
reset_dynamic_info.py
|
expose local inertia diagonal in C-API, PyBullet, through the 'getDynamicsInfo'
|
2017-12-20 14:54:32 -08:00 |
restitution.py
|
add pybullet.multiplyTransforms and pybullet.invertTransform
|
2017-05-29 21:55:58 -07:00 |
robotcontrol.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
rollPitchYaw.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
satCollision.py
|
PyBullet.loadURDF, expose flags=URDF_INITIALIZE_SAT_FEATURES
|
2018-06-13 15:35:56 -07:00 |
saveRestoreState.py
|
fix saveRestoreState.py example
|
2018-06-15 08:31:39 -07:00 |
saveWorld.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
segmask_linkindex.py
|
add segmask_linkindex.py example using p.getCameraImage(320,200,flags=p.ER_SEGMENTATION_MASK_OBJECT_AND_LINKINDEX)
|
2017-12-28 12:37:07 -08:00 |
signedDistanceField.py
|
PyBullet: add signed distance field support, with example/signedDistanceField.py
|
2018-04-16 22:57:43 +02:00 |
sleeping.py
|
expose PyBullet API to wakeup/put objects to sleep, enable/disable deactivation
|
2018-06-15 21:26:26 -07:00 |
test.py
|
more fixes in pybullet_gym envs/data.
|
2017-08-27 19:34:00 -07:00 |
testPlugin.py
|
PyBullet / BulletRobotics: prepare for pdControlPlugin and collisionFilterPlugin
|
2018-06-05 11:41:41 +10:00 |
testrender_np.py
|
improve testrender/np to render faster/interactive on Mac with matplotlib
|
2017-11-24 18:57:16 -08:00 |
testrender.py
|
improve testrender/np to render faster/interactive on Mac with matplotlib
|
2017-11-24 18:57:16 -08:00 |
transparent.py
|
Add pybullet transparent.py example, transparency with global per-object sort in GLInstancingRenderer
|
2017-06-24 19:38:31 -07:00 |
urdfEditor.py
|
PyBullet urdfEditor example, use the pybullet_utils version (more up-to-date)
|
2018-06-22 09:18:55 -07:00 |
userData.py
|
Changes UserData to use global identifiers and makes linkIndex optional.
|
2018-07-03 17:45:19 +02:00 |
vr_kitchen_setup_vrSyncPython.py
|
premake pybullet, use enable_static_vr_plugin
|
2017-10-25 10:20:34 -07:00 |
vr_kuka_control.py
|
pybullet vr_kuka_setup.py: add a gear joint, to keep the gripper centered,
|
2017-11-12 10:36:30 -08:00 |
vr_kuka_pr2_move.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
vr_kuka_setup_vrSyncPlugin.py
|
premake pybullet, use enable_static_vr_plugin
|
2017-10-25 10:20:34 -07:00 |
vr_kuka_setup_vrSyncPython.py
|
Implement the pybullet/Python equivalent of vr_kuka_setup_vrSyncPlugin.py
|
2017-10-09 10:52:25 -07:00 |
vr_kuka_setup.py
|
pybullet vr_kuka_setup.py: add a gear joint, to keep the gripper centered,
|
2017-11-12 10:36:30 -08:00 |
vr_racecar_differential.py
|
Implement first pass of transparent graphics object for GLInstancingRenderer
|
2017-06-24 13:41:33 -07:00 |
vrEvent.py
|
fix signal handling in ExampleBrowser on linux/mac on termination
|
2017-10-05 12:59:58 -07:00 |
vrhand_vive_tracker.py
|
add vrhand for vive tracker
|
2017-04-21 10:28:20 -07:00 |
vrhand.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
vrminitaur.py
|
move pybullet examples to Bullet/examples/pybullet/examples
|
2017-03-29 09:40:56 -07:00 |
vrtracker.py
|
add python dumpLog.py utility to view log files created using 'startStateLogging'
|
2017-04-12 15:02:47 -07:00 |
widows.py
|
Added manually converted widowx.urdf from https://github.com/RobotnikAutomation/widowx_arm
|
2017-06-29 17:54:04 -07:00 |