All Projects → methylDragon → Ros Sensor Fusion Tutorial

methylDragon / Ros Sensor Fusion Tutorial

Licence: mit
An in-depth step-by-step tutorial for implementing sensor fusion with robot_localization! 🛰

Projects that are alternatives of or similar to Ros Sensor Fusion Tutorial

Ros Academy For Beginners
中国大学MOOC《机器人操作系统入门》代码示例 ROS tutorial
Stars: ✭ 861 (+181.37%)
Mutual labels:  robotics, ros, tutorial
igvc-software
The code base for the RoboNav team's IGVC robot.
Stars: ✭ 78 (-74.51%)
Mutual labels:  robotics, ros
fmi adapter
Integrating functional mock-up units (FMUs) in ROS nodes
Stars: ✭ 26 (-91.5%)
Mutual labels:  robotics, ros
Awesome Weekly Robotics
A list of projects that were or will be featured in Weekly Robotics newsletter
Stars: ✭ 255 (-16.67%)
Mutual labels:  robotics, ros
ROS-TCP-Connector
No description or website provided.
Stars: ✭ 123 (-59.8%)
Mutual labels:  robotics, ros
bio ik
MoveIt kinematics_base plugin based on particle optimization & GA
Stars: ✭ 104 (-66.01%)
Mutual labels:  robotics, ros
ros-docker-images
🐳 Bring ROS to any Linux distributions.
Stars: ✭ 15 (-95.1%)
Mutual labels:  robotics, ros
erwhi-hedgehog
Erwhi Hedgehog main repository
Stars: ✭ 31 (-89.87%)
Mutual labels:  robotics, ros
Free gait
An Architecture for the Versatile Control of Legged Robots
Stars: ✭ 263 (-14.05%)
Mutual labels:  robotics, ros
Bonnet
Bonnet: An Open-Source Training and Deployment Framework for Semantic Segmentation in Robotics.
Stars: ✭ 274 (-10.46%)
Mutual labels:  robotics, ros
Camlasercalibratool
Extrinsic Calibration of a Camera and 2d Laser
Stars: ✭ 277 (-9.48%)
Mutual labels:  robotics, ros
FusionAD
An open source autonomous driving stack by San Jose State University Autonomous Driving Team
Stars: ✭ 30 (-90.2%)
Mutual labels:  robotics, ros
ROS-GPS
GPS Localization with ROS, OSM and rviz
Stars: ✭ 19 (-93.79%)
Mutual labels:  robotics, ros
erdos
Dataflow system for building self-driving car and robotics applications.
Stars: ✭ 135 (-55.88%)
Mutual labels:  robotics, ros
trac ik
ROS 2 port of `trac_ik`, an alternative Inverse Kinematics solver to the popular inverse Jacobian methods in KDL.
Stars: ✭ 14 (-95.42%)
Mutual labels:  robotics, ros
rosbots setup tools
Set up ROS, OpenCV and other ROSbots modules for your ROBbots robot
Stars: ✭ 97 (-68.3%)
Mutual labels:  robotics, ros
Cherry Autonomous Racecar
Implementation of the CNN from End to End Learning for Self-Driving Cars on a Nvidia Jetson TX1 using Tensorflow and ROS
Stars: ✭ 294 (-3.92%)
Mutual labels:  robotics, ros
aruw-vision-platform-2019
ARUW's vision code from the 2019 season. Published here, read-only, for public reference.
Stars: ✭ 37 (-87.91%)
Mutual labels:  robotics, ros
RoboticsAcademy
Learn Robotics with JdeRobot
Stars: ✭ 160 (-47.71%)
Mutual labels:  robotics, ros
Gym Gazebo2
gym-gazebo2 is a toolkit for developing and comparing reinforcement learning algorithms using ROS 2 and Gazebo
Stars: ✭ 257 (-16.01%)
Mutual labels:  robotics, ros

Sensor Fusion in ROS

Click to watch video!

An in-depth step-by-step tutorial for implementing sensor fusion with extended Kalman filter nodes from robot_localization! Basic concepts like covariance and Kalman filters are explained here!

This tutorial is especially useful because there hasn't been a full end-to-end implementation tutorial for sensor fusion with the robot_localization package yet.

You can find the implementation in the Example Implementation folder!

Why fuse sensor data

A lot of times, the individual navigation stack components in a robot application can fail more often than not, but together, they form a more robust whole than not.

One way to do this is with the extended Kalman filter from the robot_localization package. The package features a relatively simple ROS interface to help you fuse and configure your sensors, so that's what we'll be using!

How to use this tutorial

  1. Make sure you're caught up on ROS
  2. It'll be good to read the Marvelmind Indoor 'GPS' beacon tutorial alongside this if you want to understand the example implementation
  3. Likewise for the Linorobot stack
  4. And AMCL
  5. Then go ahead and follow the tutorial in order!

Yeah! Buy the DRAGON a COFFEE!

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].