Robot_pose_ekf

The robot_pose_ekf ROS package applies sensor fusion on the robot IMU and odometry values to estimate its 3D pose.
Alternatives To Robot_pose_ekf
Project NameStarsDownloadsRepos Using ThisPackages Using ThisMost Recent CommitTotal ReleasesLatest ReleaseOpen IssuesLicenseLanguage
Hdl_localization570
8 months ago52bsd-2-clauseC++
Real-time 3D localization using a (velodyne) 3D LIDAR
Robot_pose_ekf187
2 years agobsd-3-clauseC++
The robot_pose_ekf ROS package applies sensor fusion on the robot IMU and odometry values to estimate its 3D pose.
Map Based Visual Localization122
3 years agomit
A general framework for map-based visual localization. It contains 1) Map Generation which support traditional features or deeplearning features. 2) Hierarchical-Localizationvisual in visual(points or line) map. 3)Fusion framework with IMU, wheel odom and GPS sensors.
Scikit Kinematics113
4 months ago15otherPython
Python functions for working with 3D kinematics.
Awesome Vacuum91
2 years agocc0-1.0
A curated list of free and open source software and hardware to build and control a robot vacuum.
Quadruped Robot Moco 1271
3 years agoPython
MOCO通用四足机器人控制器教程
3d Mapping28
6 years ago2C++
3D mapping using a 2D laser scanner and IMU-aided visual SLAM
Cartographer_kitti_config13
4 years ago2Lua
cartographer configuration files for KITTI dataset including .lua and .launch
Google Cartographer Slam With Velodyne1610
2 years ago1Lua
3d_scanner10
8 years agoJupyter Notebook
blender python script to receive and process data from an arduino/lidar/mpu6050 based 3D_scanner
Alternatives To Robot_pose_ekf
Select To Compare


Alternative Project Comparisons
Readme

Udacity - Robotics NanoDegree Program

robot_pose_ekf package

The robot_pose_ekf ROS package applies sensor fusion on the robot IMU and odometry values to estimate its 3D pose.

Nodes

The package contains a single node

  1. robot_pose_ekf: Implements an Extended Kalman Filter, subscribes to robot measurements, and publishes a filtered 3D pose.
    • Script File: wtf.py
    • Subscriber: "/odom", "/imu_data", and "/vo "
    • Publisher: "/robot_pose_ekf/odom_combined"

alt text

Steps to launch the nodes

Step1: Install the package

$ cd /home/workspace/catkin_ws/src/
$ git clone https://github.com/udacity/robot_pose_ekf

Step2: Edit the robot_pose_ekf.launch file

<launch>

<node pkg="robot_pose_ekf" type="robot_pose_ekf" name="robot_pose_ekf">
  <param name="output_frame" value="odom_combined"/>
  <param name="base_footprint_frame" value="base_footprint"/>
  <param name="freq" value="30.0"/>
  <param name="sensor_timeout" value="1.0"/>  
  <param name="odom_used" value="true"/>
  <param name="imu_used" value="true"/>
  <param name="vo_used" value="false"/>

  <remap from="imu_data" to="/mobile_base/sensors/imu_data" />    

</node>

</launch>

Step3: Build the package

$ cd /home/workspace/catkin_ws
$ catkin_make
$ source devel/setup.bash

Step4: Launch the node

$ roslaunch robot_pose_ekf robot_pose_ekf.launch
Popular 3d Graphics Projects
Popular Imu Projects
Popular Graphics Categories

Get A Weekly Email With Trending Projects For These Categories
No Spam. Unsubscribe easily at any time.
C Plus Plus
3d
Robot
Ros
Fusion
Imu