Pinned Repositories
abr_control
Robotic arm control in Python
ACER
Actor-critic with experience replay
anymal_science_robotics_supplementary
Supplementary materials for "Learning Agile and Dynamic Motor Skills for Legged Robots"
arm_ordata
OpenRAVE data used by the ARM Lab at UMich.
awesome-rl
Reinforcement learning resources curated
awesome-robotics
A list of awesome Robotics resources
baselines
OpenAI Baselines: high-quality implementations of reinforcement learning algorithms
basic_reinforcement_learning
Python implementation of basic reinforcement learning algorithms for robotic control with v-rep simulator
DeepRL-Agents
A set of Deep Reinforcement Learning Agents implemented in Tensorflow.
gps
Guided Policy Search
giteverything's Repositories
giteverything/awesome-robotics
A list of awesome Robotics resources
giteverything/Control-of-8-DOF-Arm
Matlab and VREP Interface to Control 8-DOF Arm
giteverything/ImpedController
Cartesian impedance controller for pr2
giteverything/object-impedance-control
Object-level impedance control
giteverything/python-urx
Python library to control a robot from 'Universal Robots' http://www.universal-robots.com/
giteverything/universal-robot
For communicating with the UR5: reading data, sending commands and scripts
giteverything/UR5-drawing-project
Matlab code that can make a real UR5 robot draw on any plane within its workspace. Inverse as well as differential kinematics implemented. User's drawing can be given as input in real time. Can be used on the virtual UR5 in VREP.
giteverything/UR5-Inverse-Jacobian-Trajectory-Generator
This ROS package generates the trajectory, given a point (only the first three joints can be changed). After running catkin make, use "roslaunch assignment1 jacobian.launch" to launch the trajectory generator in Rviz. Specify the new end-effector point as follows: rostopic pub -1 /setpoint \ geometry_msgs/Point -- '0.5 ' '.05 ' '.2 '.
giteverything/UR5-probabilistic-sampling-motion-planner
This ROS package can be used to move a UR5 robot in ROS MoveIt! platform. It enables the UR5 to reach a specified pose while avoiding the obstacles that you can add to the environment.
giteverything/ur5-vrep
UR5 robot forward and inverse kinematics demo with V-REP
giteverything/usc-arm-calibration
ARM-S extrinsic calibration
giteverything/vrep-python-ai
Framework for running optimization algorithms (Genetic Algorithm / Reinforcement Learning) on V-REP, using python