mujoco
There are 377 repositories under mujoco topic.
google-deepmind/mujoco
Multi-Joint dynamics with Contact. A general purpose physics simulator.
thu-ml/tianshou
An elegant PyTorch deep reinforcement learning library.
google-deepmind/dm_control
Google DeepMind's software stack for physics-based simulation and Reinforcement Learning environments, using MuJoCo.
ikostrikov/pytorch-a2c-ppo-acktr-gail
PyTorch implementation of Advantage Actor Critic (A2C), Proximal Policy Optimization (PPO), Scalable trust-region method for deep reinforcement learning using Kronecker-factored approximation (ACKTR) and Generative Adversarial Imitation Learning (GAIL).
opendilab/DI-engine
OpenDILab Decision AI Engine. The Most Comprehensive Reinforcement Learning Framework B.P.
google-deepmind/mujoco_menagerie
A collection of high-quality models for the MuJoCo physics engine, curated by Google DeepMind.
IntelLabs/coach
Reinforcement Learning Coach by Intel AI Lab enables easy experimentation with state of the art Reinforcement Learning algorithms
Farama-Foundation/Metaworld
Collections of robotics environments geared towards benchmarking multi-task and meta reinforcement learning
google-deepmind/mujoco_mpc
Real-time behaviour synthesis with MuJoCo, using Predictive Control
sail-sg/envpool
C++-based high-performance parallel environment execution engine (vectorized env) for general RL environments.
MyoHub/myosuite
MyoSuite is a collection of environments/tasks to be solved by musculoskeletal models simulated with the MuJoCo physics engine and wrapped in the OpenAI gym API.
agi-brain/xuance
XuanCe: A Comprehensive and Unified Deep Reinforcement Learning Library
MushroomRL/mushroom-rl
Python library for Reinforcement Learning.
kevinzakka/mink
Python inverse kinematics based on MuJoCo
enactic/openarm
A fully open-source humanoid arm for physical AI research and deployment in contact-rich environments.
rl-tools/rl-tools
The Fastest Deep Reinforcement Learning Library
rohanpsingh/LearningHumanoidWalking
Training a humanoid robot for locomotion using Reinforcement Learning
Farama-Foundation/Gymnasium-Robotics
A collection of robotics simulation environments for reinforcement learning
OpenRL-Lab/openrl
Unified Reinforcement Learning Framework
google-research/robopianist
[CoRL '23] Dexterous piano playing with deep reinforcement learning.
PaulDanielML/MuJoCo_RL_UR5
A MuJoCo/Gym environment for robot control using Reinforcement Learning. The task of agents in this environment is pixel-wise prediction of grasp success chances.
vikashplus/robohive
A unified framework for robot learning
denisyarats/pytorch_sac
PyTorch implementation of Soft Actor-Critic (SAC)
TuragaLab/flybody
MuJoCo fruit fly body model and locomotion RL tasks
ikostrikov/pytorch-trpo
PyTorch implementation of Trust Region Policy Optimization
navneet-nmk/pytorch-rl
This repository contains model-free deep reinforcement learning algorithms implemented in Pytorch
aravindr93/mjrl
Reinforcement learning algorithms for MuJoCo tasks
denisyarats/drq
DrQ: Data regularized Q
Rhoban/onshape-to-robot
Converting Onshape assembly to robot definition (URDF, SDF, MuJoCo) through Onshape API
legubiao/quadruped_ros2_control
ROS2-Control implementations for Quadruped robots, include sim2real
zuoxingdong/lagom
lagom: A PyTorch infrastructure for rapid prototyping of reinforcement learning algorithms.
kevinzakka/mjctrl
Minimal, clean, single-file implementations of common robotics controllers in MuJoCo.
iit-DLSLab/Quadruped-PyMPC
A model predictive controller for quadruped robots based on the single rigid body model and written in python. Gradient-based (acados) or Sampling-based (jax)
pat-coady/trpo
Trust Region Policy Optimization with TensorFlow and OpenAI Gym
RITCHIEHuang/DeepRL_Algorithms
DeepRL algorithms implementation easy for understanding and reading with Pytorch and Tensorflow 2(DQN, REINFORCE, VPG, A2C, TRPO, PPO, DDPG, TD3, SAC)
zalo/mujoco_wasm
Simulate and Render MuJoCo Models in the Browser!