All Projects → gentaiscool → ros-vrep-slam

gentaiscool / ros-vrep-slam

Licence: MIT license
ROS and V-REP for Robot Mapping and Localization

Programming Languages

C++
36643 projects - #6 most used programming language
Makefile
30231 projects
CMake
9771 projects
python
139335 projects - #7 most used programming language
c
50402 projects - #5 most used programming language
common lisp
692 projects

Projects that are alternatives of or similar to ros-vrep-slam

Iris lama
LaMa - A Localization and Mapping library
Stars: ✭ 217 (+456.41%)
Mutual labels:  localization, mapping, slam
JuliaAutonomy
Julia sample codes for Autonomy, Robotics and Self-Driving Algorithms.
Stars: ✭ 21 (-46.15%)
Mutual labels:  localization, mapping, slam
Pythonrobotics
Python sample codes for robotics algorithms.
Stars: ✭ 13,934 (+35628.21%)
Mutual labels:  localization, mapping, slam
Door Slam
Distributed, Online, and Outlier Resilient SLAM for Robotic Teams
Stars: ✭ 107 (+174.36%)
Mutual labels:  localization, mapping, slam
UrbanLoco
UrbanLoco: A Full Sensor Suite Dataset for Mapping and Localization in Urban Scenes
Stars: ✭ 147 (+276.92%)
Mutual labels:  localization, mapping, slam
GA SLAM
🚀 SLAM for autonomous planetary rovers with global localization
Stars: ✭ 40 (+2.56%)
Mutual labels:  localization, mapping, slam
Rtabmap
RTAB-Map library and standalone application
Stars: ✭ 1,376 (+3428.21%)
Mutual labels:  localization, mapping, slam
Cartographer
Cartographer is a system that provides real-time simultaneous localization and mapping (SLAM) in 2D and 3D across multiple platforms and sensor configurations.
Stars: ✭ 5,754 (+14653.85%)
Mutual labels:  localization, mapping, slam
slam gmapping
Slam Gmapping for ROS2
Stars: ✭ 56 (+43.59%)
Mutual labels:  localization, mapping, slam
direct lidar odometry
Direct LiDAR Odometry: Fast Localization with Dense Point Clouds
Stars: ✭ 202 (+417.95%)
Mutual labels:  localization, mapping, slam
Deep Learning Localization Mapping
A collection of deep learning based localization models
Stars: ✭ 300 (+669.23%)
Mutual labels:  localization, mapping, slam
Kimera Vio
Visual Inertial Odometry with SLAM capabilities and 3D Mesh generation.
Stars: ✭ 741 (+1800%)
Mutual labels:  localization, mapping, slam
Ov2slam
OV²SLAM is a Fully Online and Versatile Visual SLAM for Real-Time Applications
Stars: ✭ 119 (+205.13%)
Mutual labels:  localization, slam
Dl Vision Papers
深度学习和三维视觉相关的论文
Stars: ✭ 123 (+215.38%)
Mutual labels:  localization, slam
Mola
A Modular Optimization framework for Localization and mApping (MOLA)
Stars: ✭ 206 (+428.21%)
Mutual labels:  localization, slam
Urbannavdataset
UrbanNav: an Open-Sourcing Localization Data Collected in Asian Urban Canyons, Including Tokyo and Hong Kong
Stars: ✭ 79 (+102.56%)
Mutual labels:  localization, slam
Iscloam
Intensity Scan Context based full SLAM implementation for autonomous driving. ICRA 2020
Stars: ✭ 232 (+494.87%)
Mutual labels:  localization, slam
awesome-mobile-robotics
Useful links of different content related to AI, Computer Vision, and Robotics.
Stars: ✭ 243 (+523.08%)
Mutual labels:  localization, slam
omnimapper
A Modular Multimodal Mapping Framework
Stars: ✭ 86 (+120.51%)
Mutual labels:  mapping, slam
ai for robotics
Visualizations of algorithms covered in Sebastian Thrun's excellent Artificial Intelligence for Robotics course on Udacity.
Stars: ✭ 125 (+220.51%)
Mutual labels:  localization, slam

ROS and V-REP for Robot Mapping and Localization

It is an implementation of robot mapping and localization using Robot Operating System (ROS) and V-REP simulator. In this project, the robot can go around the unknown area and use laser sensor to generate the mapping. In addition, we have tasks such as visual servoing and face recognition using camera and OpenCV.

Demo video

https://youtu.be/n-XK24o42Oo

Setup

In this project, we use Ubuntu 16.04 LTS operating system.

Our project requires several libraries and packages as follows:

Additional Libraries

# install hector-slam
sudo apt install ros-kinetic-hector-slam

Prepare Workspace:

# git clone this project
git clone https://github.com/gentaiscool/elec6910r-ros-project.git
# make sure you remove build and devel directories
rm -rf ./build ./devel

# install ROS kinetic from http://wiki.ros.org/kinetic/Installation/Ubuntu
# install V-REP 3.5.0 from http://www.coppeliarobotics.com/downloads.html
Prepare the workspace
# To prepare the workspace
echo "source /opt/ros/kinetic/setup.bash" >> ~/.bashrc
source ~/.bashrc
cd ./catkin_ws/
catkin_make
echo "source ./catkin_ws/devel/setup.bash" >> ~/.bashrc
source ~/.bashrc

# copy libv_repExtRosInterface to V-REP directory
cd catkin_ws/devel/lib
cp libv_repExtRosInterface.so  ~/V-REP

# double check if you have the following programs:
rviz
rqt_graph

Run the project:

roscore

# Execute V-REP
./vrep.sh
# Open scene env.ttt in V-REP and start the simulation

# Load keyboard controller
rosrun project key_teleop.py

# Load the launcher 
roslaunch hector.launch

# Also check rqt_graph and rostopic list

Features

Ros graph

Generated by rqt_graph

Keyboard control

Our code is based on key_teleop.py script. We changed the speed and the publisher node.

# Load keyboard controller
rosrun project key_teleop.py

Visual Servoing

In this task, the machine has to track and follow the yellow ball (#FFFF00).

Face recognition

In this example, we detect President Obama's face.

Authors

Note

ELEC6910R - Robotic Perception and Learning Final Project in HKUST

Acknowledgement

  • Prof. LIU Ming
  • TA: HUANG Kan
  • We also thank Chien-Sheng Wu for the assistance
Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].