vrep
There are 86 repositories under vrep topic.
ahundt/grl
Robotics tools in C++11. Implements soft real time arm drivers for Kuka LBR iiwa plus V-REP, ROS, Constrained Optimization based planning, Hand Eye Calibration and Inverse Kinematics integration.
ahundt/robotics_setup
Setup Ubuntu 18.04, 16.04 and 14.04 with machine learning and robotics software plus user configuration. Includes ceres tensorflow ros caffe vrep eigen cudnn and cuda plus many more.
marooncn/RL
Reinforcement Learning Demos
ariannagavioli/Motion-Planning-for-KUKA-LBR
🤖 A motion planning MATLAB & V-rep implementation for the KUKA LBR iiwa robotic arm, performing null-space reconfiguration for obstacle avoidance.
horverno/sze-academic-robotics-projects
Various robotics related projects in various programming languages (MATLAB, LabVIEW, C#) and techniques (V-REP, ROS, LEGO Mindstorms, Kinect, Neobotix).
Junzhuodu/ur5_vrep_python
Use python and Vrep to do the path planning for ur5 robot
mveres01/multi-contact-grasping
This project implements a simulated grasp-and-lift process in V-REP using the Barrett Hand, with an interface through a python remote API.
zanebin/UR5-manipulator-control
:pencil2: Simulation of UR5 robot assembly using vrep and python
jchoi2507/CoppeliaSim_Remote_API
CoppeliaSim control of various robots through remote API (Python) connection. UR5 industry-setting simulations.
andriusbern/NaoRL
A Reinforcement Learning framework for the NAO robot
MohamedRaslan/UR10PickAndPlace
Simple Pick And Place Matlab Script using UR10 robotic arm in Vrep
ahundt/homebrew-robotics
Homebrew formulae to automatically install tools for use in the fields of Robotics, Machine Learning, and Computer Vision.
Hrithik-verma/V-REP-line-following-drone
This contain a drone simulated in V-REP (CoppeliaSim)
akashdeepjassal/VREP-RL-bot
Reinforcement Learning in Vrep
micheleciciolla/medrob-project
Matlab and V-REP application of a Hybrid Vision/Force controller for da Vinci surgical robot project for Medical Robotics course 2019-2020
dheesaur/Marker-Based-Localisation-UAVs
The aim of this project is to use a down facing camera as a range and bearing sensor for a quadcopter for localization purposes. The environment and robot is simulated in a robot simulator V-REP, the environment consists of a 10mx10m grid with colored markers placed at regular intervals. Performance of different algorithms for marker detection is evaluated based on the error in the localization accuracy. The algorithms used are contour detection, template matching and phase correlation.
anandsaha/rl.capstone
My Udacity Machine Learning Nanodegree capstone project in Reinforcement Learning
chiragmakwana0296/Snake_Robot_ROS
A Moduler Snake Robot Based On ROS and V-Rep
PietroVitiello/ActionRepresentation
MSc Project aimed at finding an alternative way of representing robot actions. We evaluate several machine learning models to control a simulated 7-joint robotic arm using solely a wrist mounted camera as input.
heethesh/Probabilistic-Roadmap-Planner
Probabilistic Roadmap Planner with VREP Simulation for LocoBot
Hrithik-verma/drawing-robot-in-V-REP
Drawing Robot in V-REP with help of MATLAB (for Image processing)
KJaebye/Drone-Swarm-Cooperative-Transport
Implementation of the SWEVO paper: "Decentralised Aerial Swarm for Adaptive and Energy Efficient Transport of Unknown Loads".
matteosodano/Faster_Inverse_Dynamics_and_Coefficients_Identification
University group project concerning the comparison between the classical and the modified Denavit-Hartenberg convention in Newton-Euler algorithm, and the design of persistently exciting trajectories for the dynamic coefficients identification for the KUKA LWR IV+.
karadalex/vrep-raven2
Simulation and control of Raven 2 surgical robot in V-REP
isk03276/LearnToMoveUR3
Learning various robotic manipulations tasks of the UR3
matteosodano/Singularities_UR10
Project concerning the design of trajectories approaching (boundary or internal) singularities, in order to compare the effects of the kinematic controllers based on pseudo-inversion and on Damped Least-Squares.
robertandreibarbulescu/PID_wall_following
Python based controller for the Pioneer-3DX mobile robot interfaced with CoppeliaSim (VREP) using a PID controller to achieve wall following.
RoMeLaUCLA/robot-player
A wrapper library with simple, easy-to-use interfaces for controlling robots.
chiragmakwana0296/six_axis_robot_ROS
six_axis_robot_ROS
hassanyousufx/vrep-ros-control
Control a drone in VREP through ROS (Kinetic) with Python.
Hrithik-verma/ros-with-coppelisim-keyboard-control
In this repo is to control v-rep / coppealisim robot with ros through keyboard.
koseng-lc/tugas-robotika
Trajectory Planning in Three Omni-wheel mobile robots
MRPT/mrpt_vrep_bridge
Interface the Mobile Robot Programming Toolkit (MRPT) with the V-REP robotics simulator
omcandido/vrep_plugin_velodyne
V-REP plugin that publishes a full revolution of PointCloud2 point into ROS
robertandreibarbulescu/FSM_wall_following
Python-based program used to control the Pioneer 3DX mobile robot in CoppeliaSim (V-REP).