Commit Graph

1056 Commits

Author SHA1 Message Date
Erwin Coumans
a0b7b2a47c add friction_anchor to microtaur.urdf 2019-07-23 18:13:54 -07:00
Erwin Coumans
bd9fe7afc0 Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-07-23 07:27:55 -07:00
Erwin Coumans
2e85490b6b deep_mimic: replace retrained backflip policy 2019-07-23 07:27:17 -07:00
Erwin Coumans
bb962bdb6f remove some left-over debugging from deep_mimic
pybullet bump up to 2.5.3
2019-07-22 17:47:02 -07:00
Erwin Coumans
b9d4206053 Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-07-22 17:19:33 -07:00
Erwin Coumans
b433e07d33 pybullet_envs.deep_mimic: use getLinkStates for faster 'getReward'
pybullet_envs.deep_mimic: add profile timers for each thread to optimize training
2019-07-22 17:18:41 -07:00
Erwin Coumans
0630c245c8 update walk policy trained using latest PyBullet 2.5.2. Still need to update backflip policy. 2019-07-22 14:00:19 -07:00
Erwin Coumans
bf3696e5b4 fix a leak in previous commit 2019-07-22 09:28:27 -07:00
Erwin Coumans
d82c2043f0 enable useArray for deep_mimic reward 2019-07-21 13:56:10 -07:00
Erwin Coumans
0cf6685041 Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-07-21 13:13:25 -07:00
Erwin Coumans
39a4e8dcd9 Implement faster array versions of PyBullet: getJointStatesMultiDof, getLinkStates, setJointMotorControlMultiDofArray, resetJointStatesMultiDof,
Implement StablePD in C++ through setJointMotorControlMultiDofArray method for pybullet_envs.deep_mimic, see testHumanoid.py and examples/pybullet/examples/humanoidMotionCapture.py
Minor fix in ChromeTraceUtil in case startTime>endTime (why would it happen?)
2019-07-21 13:08:22 -07:00
Erwin Coumans
4732acfcb1 remove tabs from urdf 2019-07-17 12:57:44 -07:00
Erwin Coumans
ac0bfb0bfa remove trailing whitespace 2019-07-17 12:55:13 -07:00
Erwin Coumans
dff277ad7b add laikago urdf with toes (for inverse kinematics, and control over stiffness/damping to model rubber) 2019-07-17 12:30:49 -07:00
Erwin Coumans
ee9575167d expose PyBullet.calculateInverseKinematics2 that allows to specify multiple IK end effector locations (not multiple orientations)
usage example:
jointPoses = p.calculateInverseKinematics2(bodyUniqueId, [endEffectorLinkIndices], [endEffectorTargetWorldPositions])
2019-07-10 17:21:18 -07:00
Erwin Coumans
bb8f621bf9 revert SHARED_MEMORY_GUI test 2019-07-03 12:10:24 -07:00
Erwin Coumans
9db6acd97d support changeVisualShape(rgbaColor) through GraphicsServer/Client
support getCameraInfo through GraphicsServer/Client
2019-07-02 09:48:34 -07:00
Bart Moyaers
2e2169690c parse fall contact bodies 2019-06-24 15:52:27 +02:00
Erwin Coumans
d4aac235fc Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-06-19 12:08:52 -07:00
Erwin Coumans
16542aa740 tweak Mini Cheetah URDF/MTL
use /tmp/timings on Linux/Mac as default location to save profile timings (when you press 'p' in example browser)
fix in Graphics Server Example when rendering is disabled
2019-06-19 12:07:26 -07:00
Erwin Coumans
ed4515ae17 for the GraphicsServer, expose a sync transform interval: only synchronize the transform once the stepSimulation exceeds this time interval.
(for example, run the simulation at 1kHz but sync the graphics transforms to remove graphics server at 30Hz)
2019-06-19 09:45:29 -07:00
Erwin Coumans
c3b7f39aaf expose shadowMapResolution (texture resolution) and shadowMapWorldSize (size in meters in world space)
expose pybullet.ConfigureOpenGLVisualizerRequest(lightPosition=[x,y,z], shadowMapWorldSize=10.5, shadowMapResolution=16384)
See examples/pybullet/examples/configureDebugVisualizer.py for an example.
This reimplements https://github.com/bulletphysics/bullet3/pull/2295 but without creating a new command/status and explicitly referring to the debug visualizer
(since the 'getCameraImage' also has a lightPosition)
2019-06-19 09:01:16 -07:00
Erwin Coumans
7e76ee0ad7 make pybullet.getMeshData work for softbody 2019-06-17 21:43:38 -07:00
Chuyuan Fu
229e87c3c9 get mesh data api
fix compile

fix typo
2019-06-17 19:00:53 -07:00
Erwin Coumans
9d21deb712 use GUI mode in IK example 2019-06-15 12:58:02 -07:00
Erwin Coumans
e286fbd9f2 fixes for RemoteGUIHelper 2019-06-15 10:30:48 -07:00
Erwin Coumans
ee3680765e fixes for RemoteGUIHelper 2019-06-14 14:34:56 -07:00
Erwin Coumans
4318221d6d Merge remote-tracking branch 'bp/master' 2019-06-14 07:51:09 -07:00
erwincoumans
e1326adff5
Revert "C api refactor build" 2019-06-14 07:49:24 -07:00
Erwin Coumans
95a79800ec Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-06-13 23:24:42 -07:00
Erwin Coumans
6160b52fd7 graphicsServer to workaround OpenGL issues on some servers. 2019-06-13 23:24:22 -07:00
Erwin Coumans
8f9fac99bd add kinematic version that also updates the base position/orientation from the base 2019-06-13 13:26:52 -07:00
bla
3e32cf94e7 Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-06-06 21:54:47 +00:00
bla
6ab09fe06e fix testlaikago and pd_controller_stable 2019-06-06 21:54:22 +00:00
erwincoumans
36896db828 Merge remote-tracking branch 'bp/master' 2019-06-01 07:29:31 -07:00
erwincoumans
5e1d645a09
Merge pull request #2221 from goretkin/c_api_refactor_build
C api refactor build
2019-05-31 19:06:18 -07:00
Erwin Coumans
4247104050 add toes to Mini Cheetah 2019-05-31 15:04:53 -07:00
Erwin Coumans
3c74ae8366 Add approximate Mini Cheetah URDF and example in pybullet
Thanks to Sangbae Kim and Donghyun Kim at the MIT Biomimetics Robotics Lab
2019-05-31 14:21:10 -07:00
Erwin Coumans
1933661124 change quadruped, remove old files 2019-05-30 14:55:47 -07:00
erwincoumans
7a7652fd43
Merge pull request #2265 from akien-mga/dos2unix
Convert DOS (CRLF) source files to Unix (LF) line endings
2019-05-30 09:41:35 -07:00
Erwin Coumans
093986f1ee revert to previous leg style of Microtaur 2019-05-22 23:42:32 -04:00
Erwin Coumans
e13df4ce48 add toe endeffectors for IK of Microtaur 2019-05-22 22:08:45 -04:00
Erwin Coumans
d7e863e51a update microtaur URDF and example, to be compatible with minitaur_rainbow_dash 2019-05-22 10:59:20 -04:00
Rémi Verschelde
d85b800702 Convert DOS (CRLF) source files to Unix (LF) line endings
Excluded `examples/pybullet/gym/pybullet_data/` which has many (3000+)
CRLF data files (obj, mtl, urdf), and `docs/pybullet_quickstart_guide`
which has generated .js and .htm files with CRLF line endings too.
2019-05-22 10:01:32 +02:00
Erwin Coumans
af5bfb4089 added Microtaur URDF file, with basic system identification
See https://www.youtube.com/watch?v=UmGnLgpEVTE
2019-05-21 22:33:16 -04:00
Erwin Coumans
36ed4419bf Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-05-07 19:43:33 -07:00
Erwin Coumans
de8013ff75 add minitaur extended to pybullet_envs 2019-05-07 19:43:02 -07:00
Chuyuan Fu
3be2ce0adf set softbody start position and orientation in pybullet 2019-05-03 11:56:13 -07:00
Chuyuan Fu
3fb0a7c19b add set starting position and orientation to softbody 2019-05-01 16:56:40 -07:00
Gustavo Goretkin
aff54a2397 Refactor C API part of pybullet out 2019-04-29 11:28:17 -04:00
Gustavo Goretkin
9009ca914e Run cmake-format
cmake-format --command-case upper --dangle-parens true CMakeLists.txt
2019-04-29 11:03:41 -04:00
Erwin Coumans
61c099460c apply yapf 2019-04-27 14:22:02 -07:00
Erwin Coumans
efe73670ef Merge remote-tracking branch 'bp/master' 2019-04-27 14:19:58 -07:00
Erwin Coumans
ef9570c315 add yapf style and apply yapf to format all Python files
This recreates pull request #2192
2019-04-27 07:31:15 -07:00
erwincoumans
1da207efaa
Merge pull request #2209 from YungKC/patch-2
Should sort best directions that gives the highest rewards
2019-04-26 16:43:32 +02:00
Erwin Coumans
0d4392af58 rename laikago_walk.json -> txt 2019-04-18 14:18:34 -07:00
YungKC
61987dea85
Should sort best directions that gives the highest rewards
Found bug where the sort order would incorporate the lowest N rewards, instead of the highest. With this fix, one can now use fewer best directions instead.
2019-04-16 12:20:08 -07:00
erwincoumans
bf0eb4703d
Merge pull request #2200 from YungKC/patch-1
Fix render issue in server render mode (e.g., docker)
2019-04-16 06:31:58 -07:00
erwincoumans
a929e8f2e5
Merge pull request #2203 from erwincoumans/master
implement stablePD control version of testLaikago,  fix getCameraImage in VR,  only report solver analytics if enabled using setPhysicsEngineParameter
2019-04-15 08:52:03 -07:00
erwincoumans
e97a7d77af only report solver analytics if enabled using setPhysicsEngineParameter(reportSolverAnalytics=1) 2019-04-14 18:20:20 -07:00
YungKC
8f9ff5e674
Fix render issue in server render mode (e.g., docker)
px is an 1D array, and cause a runtime error when trying to strip the color channels into RGB. I fixed this by first reshape the px array into am image compatible format first.
2019-04-12 17:42:26 -07:00
erwincoumans
154c65ae4d Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-04-11 22:19:12 -07:00
erwincoumans
5ff52e47d9 report constraint solver analytics data, currently for each island the number of solver iterations used and remaining residual error. 2019-04-11 22:19:02 -07:00
Jannik Vogel
4ca8b997f9 Reduce visibility of Bullet symbols in PyBullet
Avoids version conflicts in programs using PyBullet, which also link against Bullet libraries
2019-04-08 02:59:24 +02:00
Erwin Coumans
4ae24083ee implement stablePD control version of testLaikago, in preparation for quadruped DeepMimic 2019-04-05 16:45:33 -07:00
erwincoumans
024af08320 Added laikago mocap data for a DeepMimic compatible walk cycle
Added testLaikago.py script to test this mocap data.
2019-04-04 19:40:21 -07:00
erwincoumans
76918ca26d Merge remote-tracking branch 'bp/master' 2019-04-03 20:08:05 -07:00
erwincoumans
6951aaf26a implement PyBullet removeState command. Fixes Issue #2163
https://github.com/bulletphysics/bullet3/issues/2163
2019-04-03 20:06:40 -07:00
erwincoumans
4d3f2e5b17
Merge branch 'master' into SIblock 2019-03-27 16:18:36 -07:00
Erwin Coumans
4898887265 temporary disable experimental BulletRobotics examples 2019-03-26 15:07:55 -07:00
Erwin Coumans
2ba8c22397 add actuatornet code 2019-03-26 10:05:45 -07:00
Chuyuan Fu
19f3ec8b80 fix conflut 2019-03-25 14:12:00 -07:00
iory
a8146024fd [pybullet/gym/pybullet_envs] Modified register's timestep_limit to max_episode_steps for gym 2019-03-24 03:32:20 +09:00
Erwin Coumans
94d8ee74f7 Merge branch 'master' of https://github.com/erwincoumans/bullet3 2019-03-20 15:11:03 -07:00
Erwin Coumans
f725d1201d fix memory leak in PyBullet.calculateInverseKinematics when joint limits are provided
Fixes Issue #2164
2019-03-20 15:09:48 -07:00
erwincoumans
28148eb1ed Merge remote-tracking branch 'bp/master' 2019-03-18 10:12:55 -07:00
Erwin Coumans
3acac372da add vision 60 urdf (from Ghost Robotics) and zipped random urdfs 2019-03-15 13:19:59 -07:00
erwincoumans
9662ae4ba0
Update kuka_diverse_object_gym_env.py
Fix issue in glob to separate training/test data pattern. See https://github.com/bulletphysics/bullet3/issues/2158
Thank to @TomoyaFukui
2019-03-14 09:33:48 -07:00
Damian Bemben
2ca6172f1a Fixing issue where mass of motors is uneven
Mass of motors was being tilted to the left, due to FL hip motor and RL hip motor having a mass of 1.095 and FR hip motor and BR hip motor having a mass of 0.241. This led to issues with the laikago tilting. May require further investigation to see if the laikago is at the proper center of mass!
2019-03-11 10:12:38 -07:00
erwincoumans
550f4c4785 expose maxJointVelocity through PyBullet.changeDynamics, this Fixes Issue #1890
bump up PyBullet to version 2.4.8
2019-03-11 10:12:38 -07:00
erwincoumans
ce531e6015 allow to PyBullet.changeDynamics for all links in maximal coordinate rigid bodies
change snake.py to use useMaximalCoordinate = True by default
2019-03-11 10:12:38 -07:00
erwincoumans
a1f15ae01a Expose anisotropic friction, add snake demo. Simple snake slither locomotion from > 15 years ago, thanks to Michael Ewert @ Havok!
Visit http://www.snakerobots.com to see one of these in the wild
2019-03-11 10:12:38 -07:00
Damian Bemben
b027bc92df
Fixing issue where mass of motors is uneven
Mass of motors was being tilted to the left, due to FL hip motor and RL hip motor having a mass of 1.095 and FR hip motor and BR hip motor having a mass of 0.241. This led to issues with the laikago tilting. May require further investigation to see if the laikago is at the proper center of mass!
2019-03-10 22:41:40 +00:00
erwincoumans
4ea907aacf expose maxJointVelocity through PyBullet.changeDynamics, this Fixes Issue #1890
bump up PyBullet to version 2.4.8
2019-03-09 09:23:16 -08:00
erwincoumans
32e93d9f91 allow to PyBullet.changeDynamics for all links in maximal coordinate rigid bodies
change snake.py to use useMaximalCoordinate = True by default
2019-03-08 09:20:32 -08:00
erwincoumans
9408e4f2d0 Expose anisotropic friction, add snake demo. Simple snake slither locomotion from > 15 years ago, thanks to Michael Ewert @ Havok!
Visit http://www.snakerobots.com to see one of these in the wild
2019-03-07 21:13:00 -08:00
Erwin Coumans
bd0501d3fc fix example meshScale 2019-03-02 12:11:59 -08:00
Erwin Coumans
3997ac2b61 fix issue with retina scale and picking in createVisualShape.py example 2019-03-02 12:08:25 -08:00
erwincoumans
4d711ed411 Merge remote-tracking branch 'origin/physx' into physx_clean 2019-02-28 17:52:59 -08:00
erwincoumans
2ae03f50b1 revert to original humanoidMotionCapture.py example. Add a showJointMotorTorques variable (false by default) 2019-02-27 10:01:54 -08:00
erwincoumans
8e1c1448ab Expose motor drive torque reporting for motors in spherical joints in getJointStateMultiDof. 2019-02-27 09:54:12 -08:00
Erwin Coumans
03e897d1f5 replace deep_mimic policies by versions trained using PyBullet, backflip works better now. 2019-02-24 20:12:18 -08:00
erwincoumans
a9996088c8 Implement PyBullet.getCameraImage for PhysX backend.
PhysX backend, allow arbitrary plane normal, a few other fixes.
2019-02-24 14:09:42 -08:00
erwincoumans
9ecc1cc485 Implement CustomProfilerCallback, hooking up to Bullet profiling
test dominoes
2019-02-22 09:17:55 -08:00
erwincoumans
71b1191947 texture caching and geometry caching (PhysX) for much faster loading of many same objects, helps benchmarking/comparison.
add command-line args for PhysX (numCores=..., solver=tgs, )
2019-02-21 19:24:18 -08:00
erwincoumans
3bf27cf8f2 implement rudimentary contact callback. Does PhysX have a way to report ALL contact points, every frame, so we can update contact forces etc, and report all contacts? 2019-02-20 21:38:37 -08:00
erwincoumans
adf31c8f64 remove PhysXClient.*, it was not needed (use PhysicsDirect instead) 2019-02-20 19:57:10 -08:00
Erwin Coumans
6d2ed912f5 Merge remote-tracking branch 'bp/master' 2019-02-18 19:11:03 -08:00
erwincoumans
7e5ac33cf1
Merge pull request #2105 from Somedaywilldo/master
Add Human3.6M Support for deep_mimic Environment
2019-02-18 18:07:47 -08:00
erwincoumans
bdf9b10246 more work on pybullet_envs.deep_mimic.
allow btMultiBody to not wakeup (for some RL experiments)
move deep_mimic motion files to data/motions folder, so we can use the args files unmodified.
2019-02-18 17:57:02 -08:00