All Projects → andreasgustavsson → find_moving_objects

andreasgustavsson / find_moving_objects

Licence: BSD-3-Clause License
A ROS library that finds moving objects and derives their position and velocity, based on 2D laser scan or 3D point cloud 2 data streams.

Programming Languages

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

Projects that are alternatives of or similar to find moving objects

SASensorProcessing
ROS node to create pointcloud out of stereo images from the KITTI Vision Benchmark Suite
Stars: ✭ 26 (+13.04%)
Mutual labels:  ros, ros-kinetic
summit xl sim
Packages for the simulation of the Summit XL, Summit XL HL and Summit-X (including X-WAM) robots
Stars: ✭ 32 (+39.13%)
Mutual labels:  ros, ros-kinetic
FusionAD
An open source autonomous driving stack by San Jose State University Autonomous Driving Team
Stars: ✭ 30 (+30.43%)
Mutual labels:  ros, ros-kinetic
ros openvino
A ROS package to wrap openvino inference engine and get it working with Myriad and GPU
Stars: ✭ 57 (+147.83%)
Mutual labels:  ros, ros-kinetic
ROS-GPS
GPS Localization with ROS, OSM and rviz
Stars: ✭ 19 (-17.39%)
Mutual labels:  ros, ros-kinetic
robotiq 2finger grippers
ROS packages enabling the control, visualization and simulation of the Robotiq 2 Fingers Adaptive Grippers model version C3
Stars: ✭ 59 (+156.52%)
Mutual labels:  ros, ros-kinetic
hfsd
This is a ROS package used to detect directions of free space in enclosed areas where sensors fail to get returns
Stars: ✭ 13 (-43.48%)
Mutual labels:  ros, ros-kinetic
roskinectic src
This ROS kinectic workspace src folder, which was created on Ubuntu 16.04. Here I worked on ROS1 projects like 2d & 3D SLAM, Motion Planning, SWARM of drone, RL based drone, Surveilling Robot etc.
Stars: ✭ 44 (+91.3%)
Mutual labels:  ros, ros-kinetic
conde simulator
Autonomous Driving Simulator for the Portuguese Robotics Open
Stars: ✭ 31 (+34.78%)
Mutual labels:  ros, ros-kinetic
2019-UGRP-DPoom
2019 DGIST DPoom project under UGRP : SBC and RGB-D camera based full autonomous driving system for mobile robot with indoor SLAM
Stars: ✭ 35 (+52.17%)
Mutual labels:  ros, ros-kinetic
ubiquity motor
Package that provides a ROS interface for the motors in UbiquityRobotics robots
Stars: ✭ 19 (-17.39%)
Mutual labels:  ros
trac ik
ROS 2 port of `trac_ik`, an alternative Inverse Kinematics solver to the popular inverse Jacobian methods in KDL.
Stars: ✭ 14 (-39.13%)
Mutual labels:  ros
pc guidelines
Guidelines for using IvLabs PC. General instructions for maintaining and using any PC/laptop while using Ubuntu for Robotics/DL/RL research.
Stars: ✭ 23 (+0%)
Mutual labels:  ros
uav core
The main integrator of MRS UAV packages in ROS, part of the "mrs_uav_system".
Stars: ✭ 28 (+21.74%)
Mutual labels:  ros
monocular person following
Monocular camera-based person tracking and identification ROS framework for person following robots
Stars: ✭ 124 (+439.13%)
Mutual labels:  ros
erwhi-hedgehog
Erwhi Hedgehog main repository
Stars: ✭ 31 (+34.78%)
Mutual labels:  ros
RoboticsAcademy
Learn Robotics with JdeRobot
Stars: ✭ 160 (+595.65%)
Mutual labels:  ros
VS Code ROS
Step by Step Guide to Automate Your ROS Workflow in the VS Code IDE
Stars: ✭ 136 (+491.3%)
Mutual labels:  ros
urban road filter
Real-time LIDAR-based Urban Road and Sidewalk detection for Autonomous Vehicles 🚗
Stars: ✭ 134 (+482.61%)
Mutual labels:  ros
Autonomous-Drifting
Autonomous Drifting using Reinforcement Learning
Stars: ✭ 83 (+260.87%)
Mutual labels:  ros

find_moving_objects

A ROS library that can be used to find moving objects. It derives their positions and velocities, based on a 2D LaserScan or a 3D PointCloud2 data stream.

You find more information about the package here: http://wiki.ros.org/find_moving_objects

The file src/find_moving_objects/bank.h declares a class called BankArgument. An object of this class is taken as input by the main class, Bank, also declared in this file. BankArgument mainly consists of variables that control the behavior of the Bank object. Please refer to src/find_moving_objects/bank.h or a doxygen-generated documentation for each variable. Note that Bank declares the function virtual double calculateConfidence(...), but it is up to the user of Bank to define it!

The package defines two executable ROS nodes which use the Bank; one for interpreting a LaserScan data stream and one for interpreting a PointCloud2 data stream. There are also two corresponding nodelets.

The nodelet for interpreting PointCloud2 data streams and the node interpreting LaserScan data streams are used in the provided launch file. This launch file can be used to run the interpreters on live or recorded (an example bag file is provided) sensor data. The sensors supported by the launch file are the following.

  • Intel Realsense D435 depth camera (for PointCloud2 data at about 30Hz)
  • Slamtec rplidar A2 (for LaserScan data at about 12Hz)

NOTE: If running the *_bag.launch file, then bags/*.bag.tar.gz must first be extracted to bags/*.bag. Also note that rosbag and rviz are used by the launch file.

The default values for the BankArgument variables (which are set by the default ROS parameter values as found in the launch/includes/*.launch.xml files) have been tested and work well for an office setting and a robot moving at about 0.5 m/s, equipped with the above-mentioned sensors.

NOTE: If running the launch file for real sensors, then you need the realsense2_camera and rplidar_ros packages, and the librealsense camera driver installed. These are not dependencies of find_moving_objects because this package can be used with several different sensors, not only these. The launch file is merely given as an example, and can be used by those who have the named packages installed. Also note that rviz is used by the launch file.

This library is developed for, and tested on, ROS Kinetic.

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