yunfeibai
66a8685816
Merge remote-tracking branch 'upstream/master'
2017-03-29 15:06:15 -07:00
yunfeibai
64573c38e4
Remove getBodyName API.
2017-03-29 15:03:29 -07:00
yunfeibai
de3f91b64e
Get body name from getBodyInfo.
2017-03-29 14:56:05 -07:00
Erwin Coumans
eb8c31ae82
move pybullet examples to Bullet/examples/pybullet/examples
2017-03-29 09:40:56 -07:00
Erwin Coumans
fd2c0f58bc
Merge branch 'master' of https://github.com/erwincoumans/bullet3
2017-03-27 17:25:40 -07:00
Erwin Coumans
38ad1bfb89
revert to m_jointFriction (from m_jointFriction1)
2017-03-27 10:16:55 -07:00
Erwin Coumans
4911916937
Expose 'flags' option for loadURDF, to allow customization of the URDF loading process while maintaining backward compatibility.
...
For example: URDF_USE_INERTIA_FROM_FILE flag. By default, URDF2Bullet will re-compute the inertia tensor based on mass and volume, because most URDF files have bogus Inertia values.
2017-03-27 08:30:20 -07:00
Erwin Coumans
7503418c72
Split Bullet/src/LinearMath/btSerializer.cpp into btSerializer64.cpp to make it easier to rebuild serialization structure.
...
Add several MSVC optimization flags to cmake.
Bump up VERSION because serialization format changed
Expose btScalar& jointMaxForce, btScalar& jointMaxVelocity to 'getJointInfo2' API, add backwards compatibility to examples\Importers\ImportURDFDemo\URDFImporterInterface::getJointInfo.
pybullet: expose 4 more fields to getJointInfo: jointLowerLimit/jointUpperLimit/jointMaxForce/jointMaxVelocity
fix performance issue in CMD_ACTUAL_STATE_UPDATE_COMPLETED
2017-03-26 13:06:46 -07:00
yunfeibai
0a552c3ba1
Merge remote-tracking branch 'upstream/master'
2017-03-23 13:55:44 -07:00
yunfeibai
d717b1db84
Add the API to get the body name and pybullet example call.
2017-03-23 13:54:44 -07:00
Erwin Coumans
0a654c2d58
expose optional targetVelocity to pybullet.resetJointState
...
add C-API: b3CreatePoseCommandSetJointVelocities and b3CreatePoseCommandSetJointVelocity
2017-03-23 10:29:16 -07:00
Erwin Coumans
e381e84319
Merge branch 'master' of https://github.com/erwincoumans/bullet3
2017-03-21 20:44:16 -07:00
Erwin Coumans
15e6ee1a04
add missing define in pybullet to start/stop MP4 video, pybullet.startStateLogging(STATE_LOGGING_VIDEO_MP4,"filename.mp4")
2017-03-21 20:43:23 -07:00
yunfeibai
6695268fba
Fix the issue with indentation in pr2 setup.
2017-03-20 09:52:24 -07:00
Erwin Coumans
59d16b2c42
expose video capture as logging command in b3RobotSimulatorClientAPI (C++) and pybullet (use STATE_LOGGING_VIDEO_MP4)
2017-03-16 09:13:33 -07:00
Erwin Coumans
4db6fa9e29
update minitaur.py to use minitaur.urdf (instead of quadruped.urdf), also sort the legs in the same order as real hardware
...
added test urdf files for minitaur with all fixed joints, or fixed knees.
added some stiffness/damping to minitaur legs (testing)
tiny_obj_loader, don't crash on invalid texture coordinates
btMultiBodyConstraintSolver: sweep back and forward to reduce asymmetry
2017-03-15 15:38:50 -07:00
Erwin Coumans
a613911c84
Merge remote-tracking branch 'bp/master'
2017-03-15 11:05:16 -07:00
erwincoumans
6f171f90dc
Merge pull request #1015 from JulianYG/master
...
Fixed shaking issue, and hopefully the offset should be gone.
2017-03-15 09:15:00 -07:00
Erwin Coumans
6e2850e08a
fix names (case) for Linux for MPL/hand
2017-03-14 17:03:11 -07:00
Julian
bb9601bf64
fixed numpy dependency and gripper
2017-03-14 14:43:08 -07:00
Erwin Coumans
66919cc66a
fix unreachable code
2017-03-14 13:13:16 -07:00
Julian
b686d1274c
fixed minor issues, added 1dof on end effector rotation. gripper is raw
2017-03-13 22:09:08 -07:00
Julian
7cc31e7c98
fixed minor issues, added 1dof on end effector rotation. gripper is raw
2017-03-13 22:08:17 -07:00
Julian
fabe09fe53
add 1 dof to kuka end effector
2017-03-13 22:04:28 -07:00
Julian
8145203222
add 1dof to kuka end effector
2017-03-13 22:04:16 -07:00
Erwin Coumans
5009a55ee1
Merge remote-tracking branch 'bp/master'
2017-03-13 18:50:32 -07:00
erwincoumans
1a079ceb59
Merge pull request #1003 from JulianYG/master
...
pybullet VR controller controls the kuka arm
2017-03-13 18:32:48 -07:00
Erwin Coumans
901b314a1e
clang-format pybullet.c
...
move AccessModifierOffset to -4 (public:, private:, protected: are aligned to the left in Bullet)
2017-03-13 16:06:52 -07:00
Mohi
43b0a8b6fb
Fixing a bug on Visualizer Camera and a few more
...
- resetDebugVisualizerCamera now accepts negative values for pitch and
yaw angles
- Defining kitchen model to be concave, so as to be able to put floating
objects inside
- Fixed an indention error in testrender_np.py
2017-03-13 10:41:54 -07:00
Jie Tan
8c27a62e04
remove the stub calls from rllab
2017-03-10 13:41:05 -08:00
Jie Tan
37a809f5d1
added the learning algorithm from RL-lab
2017-03-10 12:29:47 -08:00
Jie Tan
923fbe8588
add gym examples
2017-03-10 11:22:38 -08:00
Erwin Coumans
ca31bb2bbd
pybullet.ER_BULLET_HARDWARE_OPENGL and ER_TINY_RENDERER exposed (for getCameraImage, renderer=pybullet.ER_BULLET_HARDWARE_OPENGL)
...
improve performance of getCameraImage when using ER_BULLET_HARDWARE_OPENGL
2017-03-09 17:42:59 -08:00
Julian
51dc3a1710
VR controller the kuka arm
2017-03-08 19:36:41 -08:00
Erwin Coumans
f2aa67d262
improve vrhand.py
2017-03-08 14:10:43 -08:00
erwincoumans
63dc57c7e6
add pybullet file to track VR controller attached to some robot (such as minitaur)
...
press button to toggle tracking, other button to reset orientation of controller, relative to robot.
2017-03-07 08:48:23 -08:00
Erwin Coumans
f81211f3b0
fix quadruped.py, don't use 'realtime' and set timeout (in case connection to server is lost) to few seconds
2017-03-05 22:40:05 -08:00
erwincoumans
00361afea5
allow user to specify the maximum number of dofs to log in GenericRobotStateLogger (default = 12)
...
add minitaur quadruped playback of minitaur log files (real robot and simulated create the same log files)
add improved minitaur.urdf file, see https://youtu.be/lv7lybtOzeo for a preview.
2017-03-05 21:49:20 -08:00
erwincoumans
a7ad6c2860
Merge remote-tracking branch 'bp/master'
2017-03-04 15:31:02 -08:00
erwincoumans
c7579d7b82
fix quadruped, allow user to pick the maximum number of dofs to log
2017-03-04 15:30:57 -08:00
yunfeibai
e0c74a46ac
Set renderer in pybullet.
2017-03-04 13:31:30 -08:00
yunfeibai
6e3cd26f11
Log time stamp and step count.
2017-03-04 13:19:43 -08:00
erwincoumans
44b140dd38
disable the gMaxNumCmdPer1ms experiment by default (-1)
...
fix minitaur_evaluate.py script, quadruped.py
2017-03-04 12:59:21 -08:00
Erwin Coumans
34fc2fb589
create premake/cmake file for Bullet/Extras/obj2sdf
...
add missing 1.sdf for Bullet/data/kitchens/1.sdf
add support for getting keyboard events (pybullet.getKeyboardEvents and b3RobotSimulatorClientAPI::getKeyboardEvents)
2017-03-02 12:33:22 -08:00
erwincoumans
255b21a776
Merge pull request #979 from erwincoumans/master
...
fix lack of collision scaling in pybullet URDF/SDF files (only graphi…
2017-03-02 08:18:11 -08:00
yunfeibai
a33dcdb63d
Modify logging and playback to handle fixed joint.
2017-03-01 23:37:01 -08:00
Erwin Coumans
6a40c1cca7
pybullet expose resetDebugVisualizerCamera
...
example: pybullet.resetDebugVisualizerCamera(cameraDistance=3,cameraYaw=30,cameraPitch=52,cameraTargetPosition=[0,0,0])
2017-03-01 15:04:07 -08:00
Erwin Coumans
2f3ba49357
expose some sleep timeout pybullet.setPhysicsEngineParameter(maxNumCmdPer1ms=100) or b3PhysicsParamSetMaxNumCommandsPer1ms,
...
if more commands than those are processed per millisecond, a 1ms sleep will follow, to avoid other threads being stalled.
2017-03-01 13:48:57 -08:00
Erwin Coumans
ac28f50fa5
vrhand.py first try to connect to SHARED_MEMORY if that fails use GUI fallback
2017-03-01 13:01:02 -08:00
erwincoumans
929eb49029
Merge pull request #974 from erwincoumans/master
...
expose timeout in pybullet/shared memory API
2017-02-24 15:50:26 -08:00