more fixes in pybullet_envs: fix path, add missing data resources

This commit is contained in:
Erwin Coumans
2017-08-22 08:59:39 -07:00
parent 21f9d1b816
commit e064d4b837
48 changed files with 28328 additions and 12 deletions

View File

@@ -1,3 +1,4 @@
import os
import math
import gym
from gym import spaces
@@ -47,7 +48,7 @@ class SimpleHumanoidGymEnv(gym.Env):
p.resetSimulation()
#p.setPhysicsEngineParameter(numSolverIterations=300)
p.setTimeStep(self._timeStep)
p.loadURDF("%splane.urdf" % self._urdfRoot)
p.loadURDF(os.path.join(os.path.dirname(__file__),"../data","plane.urdf"))
dist = 5 +2.*random.random()
ang = 2.*3.1415925438*random.random()
@@ -99,4 +100,4 @@ class SimpleHumanoidGymEnv(gym.Env):
def _reward(self):
reward=self._humanoid.distance
print(reward)
return reward
return reward