All Projects → MyNameIsCosmo → lidar_body_tracking

MyNameIsCosmo / lidar_body_tracking

Licence: other
ROS Catkin package to track people using octree and cluster extraction

Programming Languages

C++
36643 projects - #6 most used programming language
CMake
9771 projects
python
139335 projects - #7 most used programming language

Projects that are alternatives of or similar to lidar body tracking

Lego Loam
LeGO-LOAM: Lightweight and Ground-Optimized Lidar Odometry and Mapping on Variable Terrain
Stars: ✭ 1,138 (+1573.53%)
Mutual labels:  ros, lidar
Opensimplelidar
Open Source scanning laser rangefinder
Stars: ✭ 2,206 (+3144.12%)
Mutual labels:  ros, lidar
Awesome Robotic Tooling
Tooling for professional robotic development in C++ and Python with a touch of ROS, autonomous driving and aerospace.
Stars: ✭ 1,876 (+2658.82%)
Mutual labels:  ros, lidar
Lidar camera calibration
ROS package to find a rigid-body transformation between a LiDAR and a camera for "LiDAR-Camera Calibration using 3D-3D Point correspondences"
Stars: ✭ 734 (+979.41%)
Mutual labels:  ros, lidar
teraranger
Ros nodes for single TeraRanger sensors
Stars: ✭ 19 (-72.06%)
Mutual labels:  ros, lidar
Hdl graph slam
3D LIDAR-based Graph SLAM
Stars: ✭ 945 (+1289.71%)
Mutual labels:  ros, lidar
Hdl people tracking
Real-time people tracking using a 3D LIDAR
Stars: ✭ 162 (+138.24%)
Mutual labels:  ros, lidar
monocular person following
Monocular camera-based person tracking and identification ROS framework for person following robots
Stars: ✭ 124 (+82.35%)
Mutual labels:  ros, person-tracking
direct lidar odometry
Direct LiDAR Odometry: Fast Localization with Dense Point Clouds
Stars: ✭ 202 (+197.06%)
Mutual labels:  ros, lidar
tensorflow ros cpp
Catkin-friendly C++ bindings for tensorflow.
Stars: ✭ 60 (-11.76%)
Mutual labels:  ros, catkin
Depth clustering
🚕 Fast and robust clustering of point clouds generated with a Velodyne sensor.
Stars: ✭ 657 (+866.18%)
Mutual labels:  ros, lidar
patchwork
Official page of Patchwork (RA-L'21 w/ IROS'21)
Stars: ✭ 174 (+155.88%)
Mutual labels:  ros, lidar
Interactive slam
Interactive Map Correction for 3D Graph SLAM
Stars: ✭ 372 (+447.06%)
Mutual labels:  ros, lidar
Loam velodyne
Laser Odometry and Mapping (Loam) is a realtime method for state estimation and mapping using a 3D lidar.
Stars: ✭ 1,135 (+1569.12%)
Mutual labels:  ros, lidar
Hdl localization
Real-time 3D localization using a (velodyne) 3D LIDAR
Stars: ✭ 332 (+388.24%)
Mutual labels:  ros, lidar
Lidar camera calibration
Light-weight camera LiDAR calibration package for ROS using OpenCV and PCL (PnP + LM optimization)
Stars: ✭ 133 (+95.59%)
Mutual labels:  ros, lidar
urban road filter
Real-time LIDAR-based Urban Road and Sidewalk detection for Autonomous Vehicles 🚗
Stars: ✭ 134 (+97.06%)
Mutual labels:  ros, lidar
lidar-sync-mimics-gps
Open-Source LiDAR Time Synchronization System by Mimicking GPS-clock
Stars: ✭ 52 (-23.53%)
Mutual labels:  ros, lidar
riptide setup
The software packages which power The OSU Underwater Robotics Team's AUV.
Stars: ✭ 31 (-54.41%)
Mutual labels:  ros, catkin
ws moveit
This ROS melodic workspace is created on Ubuntu 18.04. Here I worked on moveit & MTC projects like Pick, Place, Pouring task for multi-manipulator system using MoveIt Task Constructor(MTC).
Stars: ✭ 25 (-63.24%)
Mutual labels:  ros, catkin

lidar_body_tracking

ROS Catkin package to track people using ortree and cluster extraction from a fixed point.
Sensor Used for testing: Quanergy M8
Written and tested on: Ubuntu 16.04, ROS Kinetic

Dependencies

This package depends on the people_msgs package:
kdhansen/people

  1. sudo apt install ros-kinetic-easy-markers ros-kinetic-kalman-filter
  2. git clone https://github.com/kdhansen/people ~/catkin_ws/src

Installation

  1. Make your catkin workspace:
    1. mkdir -p ~/catkin_ws/src
    2. catkin_init_workspace ~/catkin_ws/src
    3. catkin_make -C ~/catkin_ws
  2. Clone kdhansen/people to your workspace:
    1. git clone https://github.com/kdhansen/people ~/catkin_ws/src
  3. Clone this repo to your workspace:
    1. git clone https://github.com/MyNameIsCosmo/lidar_body_tracking ~/catkin_ws/src
  4. Source your workspace
    1. source ~/catkin_ws/devel/setup.sh
  5. Build your workspace
    1. catkin_make -C ~/catkin_ws --pkg people_msgs
    2. catkin_make -C ~/catkin_ws

Running the tracking

  1. Initialize your LIDAR, or play your ROSBAG
    1. rosbag play -l bagname.bag
  2. Launch
    1. source ~/catkin_ws/devel/setup.sh
    2. roslaunch lidar_body_tracking lidar_body_tracking.launch

Notes

  1. The URDF frame is QP308. You can change this in /urdf/m8.launch.xacro
  2. You can change the default topics in the launch file /launch/lidar_body_tracking.launch

TODO:

  • Dynamic Reconfigure for Link, Leaf size, min cluster, etc
  • ROSParam for topics
  • Clustering of indicies for person detection
  • Output potential people to a topic
    • Calculate person velocity
    • Calculate certainty of person
    • Estimate person height, size
    • Track person based on previous location
    • people_msgs/Person does not include orientation
  • Control an RVIZ marker or something
  • Support body tracking while lidar is moving, loop closure and Odom tracking.
  • Comment and document code
    • Object-oriented
    • Clean-up code

References

ROS WIKI URDF
ROS WIKI Xacro Reference

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