2022-05-24 08:47:51 -04:00
|
|
|
import numpy as np
|
|
|
|
|
|
|
|
from gym import utils
|
|
|
|
from gym.envs.mujoco import mujoco_env
|
|
|
|
|
|
|
|
|
|
|
|
class InvertedPendulumEnv(mujoco_env.MujocoEnv, utils.EzPickle):
|
|
|
|
"""
|
|
|
|
### Description
|
|
|
|
|
|
|
|
This environment is the cartpole environment based on the work done by
|
|
|
|
Barto, Sutton, and Anderson in ["Neuronlike adaptive elements that can
|
|
|
|
solve difficult learning control problems"](https://ieeexplore.ieee.org/document/6313077),
|
|
|
|
just like in the classic environments but now powered by the Mujoco physics simulator -
|
|
|
|
allowing for more complex experiments (such as varying the effects of gravity).
|
|
|
|
This environment involves a cart that can moved linearly, with a pole fixed on it
|
|
|
|
at one end and having another end free. The cart can be pushed left or right, and the
|
|
|
|
goal is to balance the pole on the top of the cart by applying forces on the cart.
|
|
|
|
|
|
|
|
### Action Space
|
|
|
|
The agent take a 1-element vector for actions.
|
|
|
|
|
|
|
|
The action space is a continuous `(action)` in `[-3, 3]`, where `action` represents
|
|
|
|
the numerical force applied to the cart (with magnitude representing the amount of
|
|
|
|
force and sign representing the direction)
|
|
|
|
|
|
|
|
| Num | Action | Control Min | Control Max | Name (in corresponding XML file) | Joint | Unit |
|
|
|
|
|-----|---------------------------|-------------|-------------|----------------------------------|-------|-----------|
|
|
|
|
| 0 | Force applied on the cart | -3 | 3 | slider | slide | Force (N) |
|
|
|
|
|
|
|
|
### Observation Space
|
|
|
|
|
|
|
|
The state space consists of positional values of different body parts of
|
|
|
|
the pendulum system, followed by the velocities of those individual parts (their derivatives)
|
|
|
|
with all the positions ordered before all the velocities.
|
|
|
|
|
|
|
|
The observation is a `ndarray` with shape `(4,)` where the elements correspond to the following:
|
|
|
|
|
2022-05-24 23:09:05 +01:00
|
|
|
| Num | Observation | Min | Max | Name (in corresponding XML file) | Joint | Unit |
|
|
|
|
|-----|-----------------------------------------------|------|-----|----------------------------------|-------|--------------------------|
|
|
|
|
| 0 | position of the cart along the linear surface | -Inf | Inf | slider | slide | position (m) |
|
|
|
|
| 1 | vertical angle of the pole on the cart | -Inf | Inf | hinge | hinge | angle (rad) |
|
|
|
|
| 2 | linear velocity of the cart | -Inf | Inf | slider | slide | velocity (m/s) |
|
|
|
|
| 3 | angular velocity of the pole on the cart | -Inf | Inf | hinge | hinge | angular velocity (rad/s) |
|
2022-05-24 08:47:51 -04:00
|
|
|
|
|
|
|
|
|
|
|
### Rewards
|
|
|
|
|
|
|
|
The goal is to make the inverted pendulum stand upright (within a certain angle limit)
|
|
|
|
as long as possible - as such a reward of +1 is awarded for each timestep that
|
|
|
|
the pole is upright.
|
|
|
|
|
|
|
|
### Starting State
|
|
|
|
All observations start in state
|
|
|
|
(0.0, 0.0, 0.0, 0.0) with a uniform noise in the range
|
|
|
|
of [-0.01, 0.01] added to the values for stochasticity.
|
|
|
|
|
|
|
|
### Episode Termination
|
|
|
|
The episode terminates when any of the following happens:
|
|
|
|
|
|
|
|
1. The episode duration reaches 1000 timesteps.
|
|
|
|
2. Any of the state space values is no longer finite.
|
2022-05-24 23:09:05 +01:00
|
|
|
3. The absolute value of the vertical angle between the pole and the cart is greater than 0.2 radians.
|
2022-05-24 08:47:51 -04:00
|
|
|
|
|
|
|
### Arguments
|
|
|
|
|
|
|
|
No additional arguments are currently supported (in v2 and lower),
|
|
|
|
but modifications can be made to the XML file in the assets folder
|
|
|
|
(or by changing the path to a modified XML file in another folder).
|
|
|
|
|
|
|
|
```
|
|
|
|
env = gym.make('InvertedPendulum-v2')
|
|
|
|
```
|
2022-05-24 23:09:05 +01:00
|
|
|
|
2022-05-24 08:47:51 -04:00
|
|
|
There is no v3 for InvertedPendulum, unlike the robot environments where a
|
|
|
|
v3 and beyond take gym.make kwargs such as xml_file, ctrl_cost_weight, reset_noise_scale etc.
|
|
|
|
|
2022-05-24 23:09:05 +01:00
|
|
|
There is a v4 version that uses the mujoco-bindings
|
|
|
|
```
|
|
|
|
env = gym.make('InvertedPendulum-v4')
|
|
|
|
```
|
2022-05-24 08:47:51 -04:00
|
|
|
|
|
|
|
### Version History
|
|
|
|
|
2022-05-24 23:09:05 +01:00
|
|
|
* v4: all mujoco environments now use the mujoco bindings in mujoco>=2.1.3
|
2022-05-24 08:47:51 -04:00
|
|
|
* v3: support for gym.make kwargs such as xml_file, ctrl_cost_weight, reset_noise_scale etc. rgb rendering comes from tracking camera (so agent does not run away from screen)
|
|
|
|
* v2: All continuous control environments now use mujoco_py >= 1.50
|
|
|
|
* v1: max_time_steps raised to 1000 for robot based tasks (including inverted pendulum)
|
|
|
|
* v0: Initial versions release (1.0.0)
|
|
|
|
|
|
|
|
"""
|
|
|
|
|
|
|
|
def __init__(self):
|
|
|
|
utils.EzPickle.__init__(self)
|
|
|
|
mujoco_env.MujocoEnv.__init__(self, "inverted_pendulum.xml", 2)
|
|
|
|
|
|
|
|
def step(self, a):
|
|
|
|
reward = 1.0
|
|
|
|
self.do_simulation(a, self.frame_skip)
|
|
|
|
ob = self._get_obs()
|
|
|
|
notdone = np.isfinite(ob).all() and (np.abs(ob[1]) <= 0.2)
|
|
|
|
done = not notdone
|
|
|
|
return ob, reward, done, {}
|
|
|
|
|
|
|
|
def reset_model(self):
|
|
|
|
qpos = self.init_qpos + self.np_random.uniform(
|
|
|
|
size=self.model.nq, low=-0.01, high=0.01
|
|
|
|
)
|
|
|
|
qvel = self.init_qvel + self.np_random.uniform(
|
|
|
|
size=self.model.nv, low=-0.01, high=0.01
|
|
|
|
)
|
|
|
|
self.set_state(qpos, qvel)
|
|
|
|
return self._get_obs()
|
|
|
|
|
|
|
|
def _get_obs(self):
|
|
|
|
return np.concatenate([self.data.qpos, self.data.qvel]).ravel()
|
|
|
|
|
|
|
|
def viewer_setup(self):
|
|
|
|
v = self.viewer
|
|
|
|
v.cam.trackbodyid = 0
|
|
|
|
v.cam.distance = self.model.stat.extent
|