Skip to content

Commit

Permalink
Merge pull request #3082 from erwincoumans/master
Browse files Browse the repository at this point in the history
@erwincoumans bump up PyBullet and Bullet version to 3.05 (in sync for this release)
  • Loading branch information
erwincoumans committed Sep 24, 2020
2 parents 0c56317 + e454b90 commit b12da62
Show file tree
Hide file tree
Showing 6 changed files with 7 additions and 7 deletions.
1 change: 0 additions & 1 deletion Extras/Serialize/BulletFileLoader/autogenerated/bullet.h
Expand Up @@ -760,7 +760,6 @@ typedef struct bInvalidHandle {
int m_restingContactRestitutionThreshold;
int m_minimumSolverBatchSize;
int m_splitImpulse;
char m_padding[4];
};


Expand Down
2 changes: 1 addition & 1 deletion VERSION
@@ -1 +1 @@
2.89
3.05
1 change: 1 addition & 0 deletions examples/pybullet/gym/pybullet_robots/laikago/laikago.py
Expand Up @@ -6,6 +6,7 @@
p.connect(p.GUI)
p.setAdditionalSearchPath(pd.getDataPath())

p.setPhysicsEngineParameter(enableConeFriction=0)
plane = p.loadURDF("plane.urdf")
p.setGravity(0, 0, -9.8)
p.setTimeStep(1. / 500)
Expand Down
2 changes: 1 addition & 1 deletion setup.py
Expand Up @@ -501,7 +501,7 @@ def _single_compile(obj):

setup(
name='pybullet',
version='3.0.3',
version='3.0.5',
description=
'Official Python Interface for the Bullet Physics SDK specialized for Robotics Simulation and Reinforcement Learning',
long_description=
Expand Down
2 changes: 1 addition & 1 deletion src/LinearMath/btScalar.h
Expand Up @@ -25,7 +25,7 @@ subject to the following restrictions:
#include <float.h>

/* SVN $Revision$ on $Date$ from http://bullet.googlecode.com*/
#define BT_BULLET_VERSION 289
#define BT_BULLET_VERSION 305

inline int btGetVersion()
{
Expand Down
6 changes: 3 additions & 3 deletions src/LinearMath/btSerializer.h
Expand Up @@ -479,9 +479,9 @@ class btDefaultSerializer : public btSerializer
buffer[8] = 'V';
}

buffer[9] = '2';
buffer[10] = '8';
buffer[11] = '9';
buffer[9] = '3';
buffer[10] = '0';
buffer[11] = '5';
}

virtual void startSerialization()
Expand Down

0 comments on commit b12da62

Please sign in to comment.