Skip to content

Tutorials and starter code for the Robot Operating System (ROS) framework (Featuring ROS 1 and 2!) πŸ€–πŸ”₯🐲

License

Notifications You must be signed in to change notification settings

methylDragon/ros-tutorials

Folders and files

NameName
Last commit message
Last commit date

Latest commit

Β 

History

24 Commits
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 
Β 

Repository files navigation

ROS Tutorials

I've compiled a whole bunch of comprehensive tutorials and starter code templates for the Robot Operating System (ROS), for both ROS 1 and ROS 2!

Most of these can be read through in under an hour, and they're pitched at the beginner to intermediate level. But most importantly, they're designed to be CTRL-F-able!

Pre-Requisites

It will definitely help to brush up on Python and C++.

As well as Linux to be able to follow along with the tutorial.

Support my efforts!

Yeah! Buy the DRAGON a COFFEE!

Or leave a tip! γƒΎ(Β°βˆ‡Β°*)

Further Reading

After reading up on the ROS tutorials, you can do some further reading!

Robotic Manipulator Planning with MoveIt!

1563793456590

The MoveIt! project is a ROS package that helps with motion planning for robotic manipulators. As such, it is especially useful for working with and planning for arms!

https://github.com/methylDragon/moveit-tutorial

Point Cloud Library Integration with ROS

CylinderSegmentation.gif

The Point Cloud Library (or PCL) is a large scale, open project [1] for 2D/3D image and point cloud processing. The PCL framework contains numerous state-of-the art algorithms including filtering, feature estimation, surface reconstruction, registration, model fitting and segmentation. These algorithms can be used, for example, to filter outliers from noisy data, stitch 3D point clouds together, segment relevant parts of a scene, extract keypoints and compute descriptors to recognize objects in the world based on their geometric appearance, and create surfaces from point clouds and visualize them -- to name a few.

https://github.com/methylDragon/pcl-ros-tutorial

Sensor Fusion with ROS

Click to watch video!

The robot_localisation package in ROS is a very useful package for fusing any number of sensors using various flavours of Kalman Filters!

https://github.com/methylDragon/ros-sensor-fusion-tutorial

Credits

All credits and sources are listed inside the tutorials and references themselves.

                            .     .
                         .  |\-^-/|  .    
                        /| } O.=.O { |\

About

Tutorials and starter code for the Robot Operating System (ROS) framework (Featuring ROS 1 and 2!) πŸ€–πŸ”₯🐲

Topics

Resources

License

Stars

Watchers

Forks

Releases

No releases published

Packages

No packages published