YunfeiBai
539fe505a4
Add table and tray.
2016-09-26 11:31:30 -07:00
YunfeiBai
60d07a6f6e
Kuka grasp with one motor gripper.
2016-09-25 21:13:31 -07:00
YunfeiBai
b803f4e7cf
Attach gripper to kuka arm.
2016-09-25 16:05:53 -07:00
YunfeiBai
c0029135d8
Test IK in VR.
2016-09-25 14:24:28 -07:00
erwincoumans
f5e65197f4
fix pybullet.c compilation for Windows
...
add lego.urdf, duck.urdf (optimized using VHACD convex decomposition)
optimize Kiva shelf collision model (by hand, using boxes/Blender)
physics timescale toggle between 1 -> 0,25 -> 0
2016-09-24 11:25:05 -07:00
erwincoumans
278a89f7c3
Merge pull request #804 from erwincoumans/master
...
fix uninitialized variable in btMultiBody
2016-09-23 22:13:36 -07:00
erwincoumans
fe6c8775da
fix uninitialized variable in btMultiBody
...
use btAssert to detect 0 determinant in btMatrix3x3 inverse
Remove obsolete comment in PosixSharedMemory, the Windows shared memory implementation was done over a year ago
2016-09-23 21:59:38 -07:00
Mat Kelcey
36f7f44880
expose b3GetLinkState in pybullet
2016-09-23 15:57:35 -07:00
Logan Su
3b779ad3e9
Do not add limits for continuous joints.
2016-09-23 11:45:46 -07:00
erwincoumans
666c8f47b7
Merge pull request #800 from bulletphysics/iktest
...
Iktest
2016-09-23 07:40:09 -07:00
erwincoumans
b6bb937dc0
URDF: don't parse joint limit for continuous joints
...
tweak KUKA iiwa inverse kinematics test in physics server
2016-09-22 23:21:24 -07:00
erwin coumans
e356f4f1f6
add test end-effector for Kuka iiwa (IK)
2016-09-22 19:48:26 -07:00
erwin coumans
310a330572
fix InverseKinematics+API for a case without tree (custom build Jacobian)
2016-09-22 13:27:09 -07:00
erwincoumans
46b32f17bb
Add small sphere, make teddy small too
...
Add physics time scale in VR mode
Fix compound collision margin in physics server
Enable visuals for rigid body (non-multi-body) URDF/SDF loading in physics server.
2016-09-22 08:50:28 -07:00
yunfeibai
27fab2adb5
Create a demo for one motor gripper grasp.
2016-09-21 12:08:03 -07:00
erwincoumans
ffa1e39d28
Merge pull request #797 from erwincoumans/master
...
add simple pybullet robotcontrol.py example
2016-09-21 08:14:30 -07:00
erwincoumans
36b144ffa6
Merge pull request #769 from iwilkes1/master
...
Add Phong reflection to TinyRenderer
2016-09-21 08:14:18 -07:00
Erwin Coumans
89eef8e091
Merge branch 'master' of https://github.com/erwincoumans/bullet3
2016-09-20 23:19:27 -07:00
Erwin Coumans
e1ba6e9736
add simple pybullet robotcontrol.py example
2016-09-20 23:19:03 -07:00
erwincoumans
b8541cf721
Merge pull request #796 from erwincoumans/master
...
decrease some gjk/epa tolerance to improve collision detection using …
2016-09-20 17:51:49 -07:00
erwincoumans
cca2236f1a
Merge pull request #795 from YunfeiBai/master
...
Inverse kinematics with orientation constraint.
2016-09-20 17:49:35 -07:00
erwin coumans
0a628f06cc
decrease some gjk/epa tolerance to improve collision detection using very small collision margins (0.001/1mm)
...
tweak pr2 gripper.
2016-09-20 12:37:13 -07:00
yunfeibai
c01f6245d0
Quick fix of pybullet for IK with orientation constraint.
2016-09-20 11:10:13 -07:00
yunfeibai
cbda64c5e7
Update theta dot for velocity IK.
2016-09-20 10:24:48 -07:00
erwincoumans
8d4c99801e
Merge pull request #783 from bingjeff/urdf_loader_changes
...
[URDF] Edit loader to handle full inertia tensor.
2016-09-20 04:39:38 -07:00
yunfeibai
bf16c87987
Add orientation constraint to IK.
2016-09-19 17:04:05 -07:00
erwin coumans
bb23f91578
disable some logging method
2016-09-19 14:40:17 -07:00
erwin coumans
3eb149ca75
Merge branch 'master' of https://github.com/erwincoumans/bullet3
...
# Conflicts:
# examples/SharedMemory/PhysicsServerCommandProcessor.cpp
2016-09-19 14:33:55 -07:00
erwin coumans
a3aa8ef7f1
tune gripper parameters for VR demo
2016-09-19 14:31:47 -07:00
Erwin Coumans
e488c72496
fix build issue
2016-09-19 10:19:51 -07:00
erwin coumans
db3122233f
remove that odd triangle in the origin of samurai castle (VR)
...
add rolling/spinning friction to cube, remove it from plane/samurai.urdf
URDF2Bullet: support joint limits for revolute and prismatic, only if defined (if upper < lower, disable limit)
add some profiling markers to improve performance
2016-09-19 07:02:43 -07:00
Benelot
062236af70
Fix running headless to be nearly completely headless.
2016-09-18 01:03:41 +02:00
Benelot
51e51ca848
Print out effective speedup. Reduce application tick to 60/s.
2016-09-18 00:52:08 +02:00
Benelot
7cf4a2352c
Simplify the parameter interface for NNWalkers. Keys 1-9 cause speedup.
2016-09-18 00:42:34 +02:00
Erwin Coumans
8355f09b21
delete -> free due to the use of stb_image.h (which uses malloc)
2016-09-16 16:25:13 -07:00
Benelot
f0f694145d
Implement TimeWarpBase.
...
-------------------------------------
This commit implements speeding up and slowing down examples. The
example can be influenced by the parameters. A separate example will be
added to show off the capabilities of the TimeWarpBase for other
examples.
The walkers work quite well, a successful evolution was run over night
and reached a walker distance of 7.2m.
2016-09-16 09:49:18 +02:00
Erwin Coumans
567b003654
separate spinning and rolling friction coefficients, exposed in URDF as spinning_friction / m_rolling_friction
...
improvements in VR demo, add grasper etc.
2016-09-16 00:57:00 +01:00
Erwin Coumans
1d88cf71e4
separate spinning friction (torsional friction around contact normal) from
...
rolling friction (orthogonal to contact normal)
2016-09-16 00:04:33 +01:00
Erwin Coumans
4d6a95017e
default contact erp (m_erp2) was too low in physics server
...
causing gripper to penetrate box
2016-09-15 23:11:27 +01:00
Erwin Coumans
f9679bd594
prevent an issue in TinyRendererSetup example
2016-09-14 00:30:58 +01:00
Erwin Coumans
5e09b17baf
experimental Inverse Kinematics for KUKA iiwa exposed in
...
shared memory api and pybullet. Will be extended for arbitrary bodies
and with target orientation (besides target position)
2016-09-13 23:37:46 +01:00
Jeffrey Bingham
26a464bf0b
[URDF] Edit loader to handle full inertia tensor.
...
Previous URDF loader did not handle off-diagonal elements
in the URDF. This commit adds functionality to allow
the loading of an inertia matrix that has not already
been reduced to its principal components. It diagonalizes
the inertia matrix, tests that the values are real and
updates the inertial frame.
2016-09-13 08:42:33 -07:00
Benelot
faada023be
Fix error happening when using btQuaternion() to create Unit quaternion
...
instead of btQuaternion::getIdentity(). Fix problems raised by Bullet CI.
2016-09-13 09:48:45 +02:00
erwincoumans
e5a8eb2425
rolling friction -> combine using rolling*normal friction, add for both objects.
...
rolling friction -> only along the normal, until we have separate rolling friction coefficients on normal and non-normal directions
Don't teleport with grasping controller (VR)
Tune VR grasping a bit.
2016-09-12 19:10:20 +01:00
Benelot
c0285bc425
Add slider to control number of parallel evaluations.
2016-09-12 19:42:07 +02:00
Benelot
229d2501af
Add 2m ground circles. Make population config printable. Add timeseries
...
plot of individual fitnesses of each generation.
2016-09-12 16:36:37 +02:00
Benelot
88edbf8524
Implement basic evoluationary algorithm.
2016-09-11 22:25:22 +02:00
yunfeibai
ae2d256f57
Merge remote-tracking branch 'upstream/master'
2016-09-11 04:17:05 -07:00
yunfeibai
c952c50ad9
Merge remote-tracking branch 'upstream/master'
2016-09-11 04:11:51 -07:00
Erwin Coumans
7df9b69039
pybullet: add option to use NumPy to speed up, thanks to moof2k
...
option is disabled by default. When using cmake, use
cmake -DBUILD_PYBULLET=ON -DBUILD_PYBULLET_NUMPY=ON
then both testrender.py and testrender_np.py will work
without numpy only testrender.py works.
The numpy.reshape is likely a no-op when using numpy array,
so we could remove testrender_np.py...
See https://github.com/bulletphysics/bullet3/pull/774
2016-09-11 11:35:12 +01:00
Erwin Coumans
5c76b01659
allow pybullet with or without NumPy
2016-09-11 11:09:51 +01:00
Erwin Coumans
c75bbd4608
allow pybullet with or without numpy using PYBULLET_USE_NUMPY define (in build system)
2016-09-11 11:09:10 +01:00
Erwin Coumans
e921f1b9b7
remove duplicate definitions of SHARED_MEMORY_MAX_STREAM_CHUNK_SIZE
2016-09-11 08:40:58 +01:00
Erwin Coumans
82661d98cd
init ERP for second btMultiBodyJointMotor,
...
comment-out debug printf in Kuka IK example
2016-09-11 05:54:47 +01:00
yunfeibai
a00841a498
Compute delta S from Bullet link state.
2016-09-10 19:18:29 -07:00
yunfeibai
1b72b91bcf
Expose link state in RobotSimAPI.
2016-09-10 18:48:57 -07:00
erwin coumans
c5d775a635
disable real-time by default
2016-09-09 14:41:23 -07:00
erwin coumans
3c706306cd
add experimental pr2-gripper support in VR physics server
...
add setErp to btMultiBodyJointMotor
2016-09-09 14:30:37 -07:00
erwin coumans
f72982306e
fix issues with VR physics server
2016-09-09 11:28:38 -07:00
Erwin Coumans
016dc273c6
fix an SSE/SIMD 16-byte alignment issue
2016-09-09 09:01:04 -07:00
erwin coumans
4ab02a07e5
Merge branch 'master' of https://github.com/erwincoumans/bullet3
2016-09-08 15:22:41 -07:00
erwin coumans
32eccdff61
Create project file for BussIK inverse kinematics library (premake, cmake)
...
URDF/SDF: add a flag to force concave mesh collisiofor static objects. <collision concave="yes" name="pod_collision">
VR: support teleporting using buttong, allow multiple controllers to be used, fast wireframe rendering,
Turn off warnings about deprecated C routine in btScalar.h/b3Scalar.h
Add a dummy return to stop a warning
Expose defaultContactERP in shared memory api/pybullet.
First start to expose IK in shared memory api/pybullet (not working yet)
2016-09-08 15:15:58 -07:00
Erwin Coumans
e0127bdb54
merge pybullet.c after conflicts due to Jeff's formatting pull request.
2016-09-08 11:12:58 -07:00
Erwin Coumans
8ba9a04dd9
Merge remote-tracking branch 'bp/master'
2016-09-08 07:39:48 -07:00
yunfeibai
c94a8e0d35
Use body Jacobian from Bullet for IK.
2016-09-07 23:14:23 -07:00
yunfeibai
f635c64205
Expose Jacobian computation to RobotSimAPI.
2016-09-07 17:37:38 -07:00
erwincoumans
f4ac577baf
Merge pull request #771 from bingjeff/master
...
pybullet tweaks for double precision
2016-09-07 17:36:01 -07:00
erwincoumans
ba2f522e05
Update BulletUrdfImporter.cpp
...
use free (and not delete), since b3ImportMeshUtility/stbi_load uses malloc (and not new)
2016-09-07 16:02:16 -07:00
yunfeibai
c198029cb9
Expose body Jacobian in shared memory API.
2016-09-07 16:00:38 -07:00
Jeffrey Bingham
f7ed0d7703
[format] Convert pybullet.c to consistent style.
2016-09-06 23:43:57 -07:00
Jeffrey Bingham
edef18e161
[python] Convert physics calls to double precision.
...
In order to feed Bullet the correct values when
compiled with double precision the pybullet interface
needs to pass double precision values.
2016-09-06 23:31:41 -07:00
Benelot
d9a2113b28
Implement simple body part drop strategy to resolve body
...
interpenetrations
2016-09-06 22:30:46 +02:00
erwincoumans
4944aca28b
Update our_gl.cpp
2016-09-06 13:26:08 -07:00
erwincoumans
630fcda38b
fix compile issue pybullet on MSVC 2010
2016-09-03 09:53:21 -07:00
erwin coumans
de5d1b5cfc
make husky wheels soft/compliant
...
reduce shadow size to make VR on older GPU (Mac Pro 2013) perform more smooth
less sleep in physics thread.
2016-09-03 08:39:40 -07:00
erwincoumans
4c9b009d5b
Merge pull request #770 from erwincoumans/master
...
export contact friction/damping through URDF and API
2016-09-02 18:18:21 -07:00
Erwin Coumans
ecd814c9c5
export contact friction/damping through URDF and API
...
convert from contact friction/damping to cfm/erp
btCollisionObject::setContactFrictionAndDamping
2016-09-02 16:40:56 -07:00
Ian Wilkes
2336be02e4
Added Phong refelction to the TinyRenderer Shader.
2016-09-02 11:56:03 -07:00
Ian Wilkes
ba583feb7f
Updated TinyRenderer intensity paramater.
...
Switched from ranging from 0 to 1 - ambient to -1 * (1-ambient) to (1-ambient).
2016-09-02 11:56:03 -07:00
erwincoumans
21c60c66ec
Merge pull request #767 from ludi1001/urdf-joint-transforms
...
Fix joint orientations when loading URDF files.
2016-09-02 08:21:02 -07:00
Erwin Coumans (Google)
f7522873f9
fix compile issue on Linux
2016-09-01 22:11:07 -07:00
Erwin Coumans
fe54f146ad
Merge branch 'master' of https://github.com/erwincoumans/bullet3
2016-09-01 21:26:38 -07:00
Erwin Coumans
e98fca1e5e
implement pybullet.getContactPointData(), two optional object unique ids as filter
...
returns a pylist of contact points. Each point has the following data:
0 int m_contactFlags;//unused for now
1 int m_bodyUniqueIdA;
2 int m_bodyUniqueIdB;
3 int m_linkIndexA;
4 int m_linkIndexB;
5-6-7 double m_positionOnAInWS[3];//contact point location on object A, in world space coordinates
8-9-10 double m_positionOnBInWS[3];//contact point location on object A, in world space coordinates
11-12-13 double m_contactNormalOnBInWS[3];//the separating contact normal, pointing from object B towards object A
14 double m_contactDistance;//negative number is penetration, positive is distance.
15 double m_normalForce;
2016-09-01 18:28:39 -07:00
Logan Su
9d2d286c46
Fix joint orientations when loading URDF files.
2016-09-01 18:12:14 -07:00
erwincoumans
a370c3bbac
Merge pull request #765 from YunfeiBai/master
...
Torsional and rolling friction for btMultiBody
2016-09-01 14:57:46 -07:00
erwincoumans
fe46ee8adf
Merge branch 'master' of https://github.com/erwincoumans/bullet3
...
Conflicts:
examples/SharedMemory/PhysicsServerCommandProcessor.cpp
2016-09-01 13:32:07 -07:00
erwincoumans
85fd7f560c
add first draft of contact point query in shared memory API
...
b3SharedMemoryCommandHandle b3InitRequestContactPointInformation(b3PhysicsClientHandle physClient);
void b3SetContactFilterBodyA(b3SharedMemoryCommandHandle commandHandle, int bodyUniqueIdA);
void b3SetContactFilterBodyB(b3SharedMemoryCommandHandle commandHandle, int bodyUniqueIdB);
void b3GetContactPointInformation(b3PhysicsClientHandle physClient, struct b3ContactInformation* contactPointData);
Implemented for PhysicsClientSharedMemory, not for PhysicsDirect yet.
Add btCollisionObject::setUserIndex2
2016-09-01 13:30:07 -07:00
Jeffrey Bingham
1c65cae6d0
[SharedMemory] Calculate inverse dynamics now uses world gravity.
...
Small change that takes the world gravity and applies it to the
body during the call to inverse dynamics in the shared memory
interface. Otherwise the gravity vector is left at the default
value and there is currently no interface to set the gravity
for the inverse dynamics system.
2016-09-01 10:46:34 -07:00
erwincoumans
7790ee2f02
fix compile issue with pybullet.c on Visual Studio
2016-08-31 16:05:42 -07:00
yunfeibai
9c124b5896
Rolling friction demo for sphere and torsional friction demo for two point contact.
2016-08-30 17:50:37 -07:00
Erwin Coumans
e6865a1186
Merge remote-tracking branch 'bp/master'
2016-08-30 14:44:35 -07:00
Erwin Coumans
a30ff20e6b
preparation for KUKA IK tracking example
2016-08-30 14:44:11 -07:00
yunfeibai
d784c61b61
Add rolling friction, set rolling friction coefficient from urdf, and set up two point contact experiment.
2016-08-30 11:19:23 -07:00
Logan Su
f86ce4d44b
Add flags to load inertia values from URDF.
2016-08-29 15:09:18 -07:00
Erwin Coumans
900fd86d58
fix R2D2GraspExample
2016-08-29 12:35:02 -07:00
Erwin Coumans
e47c74ce0b
prevent crash when using --opengl2 option in ExampleBrowser.
2016-08-29 11:48:31 -07:00
erwin coumans
4094b9f0df
Disable 'm_robotSim.setNumSimulationSubSteps' because it is not needed at the moment
...
Fix issue in contact/friction between btMultibody and btRigidBody (external force/torque of btRigidBody was not taken into account during contact/friction setup)
Allow 0.1 mm slop in contact, to avoid loosing contact. Todo: allow contacts with positive distance in multibody solver.
2016-08-27 13:44:18 -07:00
erwincoumans
c741b17da8
Merge pull request #758 from YunfeiBai/master
...
Expose slider constraint in RobotSimAPI.
2016-08-26 12:26:08 -07:00
erwincoumans
79be5800cb
Merge pull request #757 from erwincoumans/master
...
fix in structure alignment of btMultiBodyLinkDoubleData and btMultiBo…
2016-08-26 12:08:29 -07:00
yunfeibai
5b9b5178f9
Expose slider constraint in RobotSimAPI.
2016-08-26 10:35:10 -07:00
erwin coumans
c5164e503f
fix in structure alignment of btMultiBodyLinkDoubleData and btMultiBodyDoubleData
...
causing serialization issue in URDF/SDF loading in double-precision mode on Windows 32bit.
(it was fine on Mac/Linux 64bit)
bump serialization version to 2.85, as we change the file format
fix in name clash in makesdna.cpp -> intptr_t is already defined.
2016-08-26 10:00:29 -07:00
yunfeibai
c26da8440d
Add slider constraint.
2016-08-25 11:54:59 -07:00
yunfeibai
758ca025d5
Set physics clock subdivider.
2016-08-24 14:25:06 -07:00
yunfeibai
3b25489d89
Further fix for integration test.
2016-08-24 12:44:24 -07:00
yunfeibai
ecbf94abaa
Fix issues in build test.
2016-08-24 11:31:08 -07:00
yunfeibai
d46710e447
Expose fixed constraint in RobotSimAPI.
2016-08-22 18:14:29 -07:00
yunfeibai
8eccac6fd8
Update CMakeLists to be the same as upstream.
2016-08-22 10:26:56 -07:00
YunfeiBai
6751648bce
add some micro-sleep to prevent 100% CPU/memory bus hogging, preventing the graphics thread from making progress.
...
debug draw color black for contact normal
move debug draw option for constraint frames into 'k' key.
2016-08-19 13:58:53 -07:00
YunfeiBai
94161246d9
Merge remote-tracking branch 'bp/master'
2016-08-19 12:02:48 -07:00
YunfeiBai
4611f5f097
Merge branch 'master' of https://github.com/YunfeiBai/bullet3
2016-08-19 12:01:09 -07:00
YunfeiBai
d26c424e11
modify cmake for pybullet
2016-08-19 12:00:55 -07:00
Erwin Coumans
7db9a020b9
debug draw contact normals (1cm) use black color
2016-08-19 10:55:21 -07:00
erwin coumans
62d5b7c5c0
add single step simulation, using 'o' key. use 'i' key to suspend simulation first
...
default background color a bit darker, to show debug lines
tweaked contact point rendering a bit
2016-08-19 10:30:02 -07:00
erwin coumans
a68c9ca845
avoid MT crash in VR/physics server due to printf from separate thread.
...
add fps display in VR
use 1./240. internal substep for real-time physics sim in VR/physics server for more accurate robotics sim.
2016-08-18 21:43:43 -07:00
Erwin Coumans
91839cb274
revert change of default position control in shared memory api/pybullet
2016-08-18 16:48:14 -07:00
erwin coumans
8c2b1386ce
Merge branch 'master' of https://github.com/erwincoumans/bullet3
2016-08-18 15:54:43 -07:00
erwin coumans
2c636b52f7
bugfix: in torque control mode, torque index starts at 6.
2016-08-18 15:36:18 -07:00
Erwin Coumans
ab8f498d18
avoid infinite recursion in b3Clock::usleep
2016-08-18 13:44:04 -07:00
erwin coumans
5b0253ed47
Remove undesired assert, it makes pybullet mistakes fail in c++
...
Shared memory api/pybullet: by default, set joint motors in position PD mode with target 0, to maintain 0 joint angle.
pybullet: allow setJointControlMode(body, link, POSITION_CONTROL,targetPos etc.
2016-08-18 13:10:28 -07:00
erwin coumans
6005e54aa1
Fix some inconsistencies in URDF file handling between btRigidBody and btMultiBody
...
(rotation order and application of root-inertial-frame offset)
2016-08-18 09:44:33 -07:00
Erwin Coumans
8f21e2bca9
fix compile issue
2016-08-17 20:01:45 -07:00
Erwin Coumans
17c16ccfa0
pybullet, deal with overflow of joints (maximum of 128 joints/links per multibody at the moment)
...
increase from 64 to 128 joints in shared memory API/pybullet
fix potential issue in tinyrenderer, related to missing segmentation mask buffer
report error if CMD_REQUEST_ACTUAL_STATE command on a multibody that exceed the number of links,
todo: stream data to allow arbitrary large number of links in shared memory API
2016-08-17 19:35:52 -07:00
Erwin Coumans
7c9441c3f5
by default, have a strong force keep the robot together, instead of floppy joints.
2016-08-17 10:30:50 -07:00
Erwin Coumans
dce73f48ae
Merge remote-tracking branch 'bp/master'
2016-08-17 10:24:12 -07:00
Erwin Coumans
463f3e59c8
minor tweak in F1/screenshot handling. Note you can use --png_skip_frames=x command-line argument
2016-08-17 10:18:33 -07:00
yunfeibai
591f922d97
Support loading Urdf as btRigidBody with RobotSimAPI. Loading Sdf as btRigidBody is work in progress.
2016-08-16 17:56:30 -07:00
yunfeibai
4bc31394a0
Allow choosing loaded as btRigidBody with RobotSimAPI.
2016-08-16 16:57:48 -07:00
yunfeibai
9c4cfde3d6
Fixed constraint for btMultiBody and btRigidBody.
2016-08-15 13:19:00 -07:00
Erwin Coumans
985a6c203f
fix typo
2016-08-13 12:38:40 -07:00
erwin coumans
3bdcf23a05
Add sleep to avoid 100% busy CPU loop in PhysicsServerExample
...
Added btClock::usleep
Fix broken TinyRenderer example code.
2016-08-13 12:21:18 -07:00
Erwin Coumans
238ba8c642
remote a c++11-style constructor
2016-08-12 14:28:02 -07:00
Erwin Coumans
ceceaa16be
make some changes to make the previous example code changes backward compatible
2016-08-12 14:18:46 -07:00
Erwin Coumans
c75bebcafe
revert accidently renaming of m_depthvalues4
2016-08-12 13:55:37 -07:00
Erwin Coumans
4abe083388
fix pybullet
2016-08-11 15:58:51 -07:00
Erwin Coumans
4bb488f65e
reset canvas location
2016-08-11 15:02:00 -07:00
Erwin Coumans
3c30e2f821
add segmentation mask rendering to TinyRenderer and shared memory API
...
similar to the zbuffer, but storing the object index (int) instead of float depth
2016-08-11 14:55:30 -07:00
Erwin Coumans
f416644481
set the camera, even in multi-threaded mode
2016-08-11 11:20:31 -07:00
erwin coumans
a9b1544a9f
Add premake support to build pybullet, Windows and Linux tested, will enable Mac in next commit.
...
Expose inverse dynamics to Bullet shared memory API, through b3CalculateInverseDynamicsCommandInit and
b3GetStatusInverseDynamicsJointForces command/status. See PhysicsClientExeample or pybullet for usage.
Add option for Windows and Linux to set python_lib_dir and python_include_dir for premake and --enable_pybullet option
Expose inverse dynamics to pybullet: [force] = p.calculateInverseDynamics(objectIndex,[q],[qdot],[acc])
Thanks to Jeff Bingham for the suggestion.
2016-08-09 18:40:12 -07:00
Erwin Coumans
b880ddf76b
add pybullet render API with yaw/pitch/roll option
...
add testrender.py file
allow option to enable OpenGL hardware renderer in multithreaded sim
b3RequestCameraImageSelectRenderer(commandHandle,ER_BULLET_HARDWARE_OPENGL);
2016-08-08 14:23:44 -07:00
Benjamin Ellenberger
dcfa5a3ee2
Clear gContactProcessedCallback on exiting physics.
2016-08-02 20:38:36 +02:00
Erwin Coumans
f5fca86d49
remove debug printf
2016-08-02 11:14:21 -07:00
Erwin Coumans
f304fd7611
add one more pybullet renderImage API and testrender.py example
...
tweak Bullet Inverse Dynamics, work-around compiler issue
2016-08-02 11:12:23 -07:00
Erwin Coumans
93db3d7ba6
fix CMD_INIT_POSE+INIT_POSE_HAS_INITIAL_ORIENTATION,
...
setWorldToBaseRot takes inverse orientation (need to remove that API!)
2016-08-02 09:30:33 -07:00
Erwin Coumans
04cd9e18d6
add [] in error message of texture loading, to show leading/trailing spaces
2016-08-01 23:53:38 -07:00
Erwin Coumans
a608f9bfdd
fix trailing space issue in tinyobjloader/mtl files.
2016-08-01 23:46:35 -07:00
Erwin Coumans
b759ab8a91
fix overflow visual shape in COLLADA .dae file importer.
2016-08-01 23:45:14 -07:00
Benjamin Ellenberger
4622ab4299
Merge commit.
2016-07-31 16:22:50 +02:00
Benjamin Ellenberger
46af3ddc54
Normal settings.
2016-07-31 16:07:38 +02:00
erwincoumans
0c0b4be665
Merge pull request #722 from matpalm/fixSetIdentity
...
fix setidentity bug
2016-07-29 14:50:16 -07:00
Mat Kelcey
80dfec170b
fix setidentity bug
2016-07-29 14:43:55 -07:00