All Projects → praveen-palanisamy → Multiple Object Tracking Lidar

praveen-palanisamy / Multiple Object Tracking Lidar

Licence: mit
C++ implementation to Detect, track and classify multiple objects using LIDAR scans or point cloud

Labels

Projects that are alternatives of or similar to Multiple Object Tracking Lidar

Loam velodyne
Laser Odometry and Mapping (Loam) is a realtime method for state estimation and mapping using a 3D lidar.
Stars: ✭ 1,135 (+255.8%)
Mutual labels:  ros, pcl
Point Cloud Filter
Scripts showcasing filtering techniques applied to point cloud data.
Stars: ✭ 34 (-89.34%)
Mutual labels:  ros, pcl
Ndt omp
Multi-threaded and SSE friendly NDT algorithm
Stars: ✭ 291 (-8.78%)
Mutual labels:  ros, pcl
Lidar camera calibration
Light-weight camera LiDAR calibration package for ROS using OpenCV and PCL (PnP + LM optimization)
Stars: ✭ 133 (-58.31%)
Mutual labels:  ros, pcl
Pcl Learning
🔥PCL(Point Cloud Library)点云库学习记录
Stars: ✭ 106 (-66.77%)
Mutual labels:  ros, pcl
Grid map
Universal grid map library for mobile robotic mapping
Stars: ✭ 1,135 (+255.8%)
Mutual labels:  ros, pcl
Depth clustering
🚕 Fast and robust clustering of point clouds generated with a Velodyne sensor.
Stars: ✭ 657 (+105.96%)
Mutual labels:  ros, pcl
Ira laser tools
All laser type assemblers and manipulators.
Stars: ✭ 87 (-72.73%)
Mutual labels:  ros, pcl
Pcl Ros Cluster Segmentation
Cluster based segmentation of Point Cloud with PCL lib in ROS
Stars: ✭ 123 (-61.44%)
Mutual labels:  ros, pcl
cloud to map
Algorithm that converts point cloud data into an occupancy grid
Stars: ✭ 26 (-91.85%)
Mutual labels:  ros, pcl
Dynamixelsdk
ROBOTIS Dynamixel SDK (Protocol1.0/2.0)
Stars: ✭ 266 (-16.61%)
Mutual labels:  ros
Segmenters lib
The LiDAR segmenters library, for segmentation-based detection.
Stars: ✭ 269 (-15.67%)
Mutual labels:  ros
Universal robots ros driver
Driver enabling ROS operation of UR robots.
Stars: ✭ 289 (-9.4%)
Mutual labels:  ros
Gym Gazebo2
gym-gazebo2 is a toolkit for developing and comparing reinforcement learning algorithms using ROS 2 and Gazebo
Stars: ✭ 257 (-19.44%)
Mutual labels:  ros
Free gait
An Architecture for the Versatile Control of Legged Robots
Stars: ✭ 263 (-17.55%)
Mutual labels:  ros
Cadrl ros
ROS package for dynamic obstacle avoidance for ground robots trained with deep RL
Stars: ✭ 309 (-3.13%)
Mutual labels:  ros
Geolocatorplugin
Geolocation plugin for Xamarin and Windows
Stars: ✭ 257 (-19.44%)
Mutual labels:  pcl
Awesome Weekly Robotics
A list of projects that were or will be featured in Weekly Robotics newsletter
Stars: ✭ 255 (-20.06%)
Mutual labels:  ros
Fast gicp
A collection of GICP-based fast point cloud registration algorithms
Stars: ✭ 307 (-3.76%)
Mutual labels:  pcl
Ros qtc plugin
ROS Qt Creator Plug-in (https://ros-qtc-plugin.readthedocs.io)
Stars: ✭ 295 (-7.52%)
Mutual labels:  ros

Multiple objects detection, tracking and classification from LIDAR scans/point-clouds

DOI

Sample demo of multiple object tracking using LIDAR scans

PCL based ROS package to Detect/Cluster --> Track --> Classify static and dynamic objects in real-time from LIDAR scans implemented in C++.

Features:

  • K-D tree based point cloud processing for object feature detection from point clouds
  • Unsupervised euclidean cluster extraction (3D) or k-means clustering based on detected features and refinement using RANSAC (2D)
  • Stable tracking (object ID & data association) with an ensemble of Kalman Filters
  • Robust compared to k-means clustering with mean-flow tracking

Usage:

Follow the steps below to use this (multi_object_tracking_lidar) package:

  1. Create a catkin workspace (if you do not have one setup already).
  2. Navigate to the src folder in your catkin workspace: cd ~/catkin_ws/src
  3. Clone this repository: git clone https://github.com/praveen-palanisamy/multiple-object-tracking-lidar.git
  4. Compile and build the package: cd ~/catkin_ws && catkin_make
  5. Add the catkin workspace to your ROS environment: source ~/catkin_ws/devel/setup.bash
  6. Run the kf_tracker ROS node in this package: rosrun multi_object_tracking_lidar kf_tracker

If all went well, the ROS node should be up and running! As long as you have the point clouds published on to the filtered_cloud rostopic, you should see outputs from this node published onto the obj_id, cluster_0, cluster_1, …, cluster_5 topics along with the markers on viz topic which you can visualize using RViz.

Supported point-cloud streams/sources:

The input point-clouds can be from:

  1. A real LiDAR or
  2. A simulated LiDAR or
  3. A point cloud dataset or
  4. Any other data source that produces point clouds

Note: This package expects valid point cloud data as input. The point clouds you publish to the "filtered_cloud" is not expected to contain NaNs. The point cloud filtering is somewhat task and application dependent and therefore it is not done by this module. PCL library provides pcl::removeNaNFromPointCloud (...) method to filter out NaN points. You can refer to this example code snippet to easily filter out NaN points in your point cloud.

Citing

If you use the code or snippets from this repository in your work, please cite:

@software{praveen_palanisamy_2019_3559187,
  author       = {Praveen Palanisamy},
  title        = {{praveen-palanisamy/multiple-object-tracking-lidar: 
                   Multiple-Object-Tracking-from-Point-Clouds_v1.0.2}},
  month        = dec,
  year         = 2019,
  publisher    = {Zenodo},
  version      = {1.0.2},
  doi          = {10.5281/zenodo.3559187},
  url          = {https://doi.org/10.5281/zenodo.3559186}
}

Wiki

Checkout the Wiki pages

  1. Multiple-object tracking from pointclouds using a Velodyne VLP-16
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].