DISCONTINUATION OF PROJECT.
This project will no longer be maintained by Intel.
Intel has ceased development and contributions including, but not limited to, maintenance, bug fixes, new releases, or updates, to this project.
Intel no longer accepts patches to this project.
If you have an ongoing need to use this project, are interested in independently developing it, or would like to maintain patches for the open source software community, please create your own fork of this project.
Object Analytics (OA) is ROS wrapper for realtime object detection, localization and tracking. These packages aim to provide real-time object analyses over RGB-D camera inputs, enabling ROS developer to easily create amazing robotics advanced features, like intelligent collision avoidance and semantic SLAM. It consumes sensor_msgs::PointClould2 data delivered by RGB-D camera, publishing topics on object detection, object tracking, and object localization in 3D camera coordination system.
OA keeps integrating with various "state-of-the-art" algorithms.
ROS packages from ros-kinetic-desktop-full
roscpp
Other ROS packages
NOTE: OA depends on tracking feature from OpenCV (3.3 preferred, 3.2 minimum). The tracking feature is recently provided by ROS Kinetic package "ros-kinetic-opencv3" (where OpenCV 3.3.1 is integrated). However, if you're using an old version of ROS Kinetic (where OpenCV 3.2 is integrated), tracking feature is not provided. In such case you need self-build tracking from opencv_contrib. It is important to keep opencv_contrib (self-built) and opencv (ROS Kinetic provided) in the same OpenCV version that can be checked from "/opt/ros/kinetic/share/opencv3/package.xml"
to build
cd ${ros_ws} # "ros_ws" is the catkin workspace root directory where this project is placed in
catkin_make
to test
catkin_make run_tests
to install
catkin_make install
RGB-D camera
roslaunch realsense_ros_camera rs_rgbd.launch
roslaunch openni_launch openni.launch
roslaunch astra_launch astra.launch
roslaunch object_analytics_launch analytics_opencl_caffe.launch
launch with Movidius NCS as detection backend
roslaunch object_analytics_launch analytics_movidius_ncs.launch
Frequently used options
roslaunch object_analytics_launch analytics_movidius_ncs.launch aging_th:=30 probability_th:="0.3"
object_analytics/rgb (sensor_msgs::Image)
object_analytics/pointcloud (sensor_msgs::PointCloud2)
object_analytics/localization (object_analytics_msgs::ObjectsInBoxes3D)
object_analytics/tracking (object_analytics_msgs::TrackedObjects)
object_analytics/detection (object_msgs::ObjectsInBoxes)
topic | fps | latency sec | |
OpenCL Caffe | |||
localization | 6.63 | 0.23 | |
detection | 8.88 | 0.17 | |
tracking | 12.15 | 0.33 | |
Movidius NCS | |||
localization | 7.44 | 0.21 | |
detection | 10.5 | 0.15 | |
tracking | 13.85 | 0.24 |
Steps to enable visualization on RViz are as following
roslaunch object_analytics_visualization rviz.launch