[ros-users] [Discourse.ros.org] [Next Generation ROS] ROS2 Object Analytics Release

Chris Ye ros.discourse at gmail.com
Fri Sep 7 01:44:52 UTC 2018



# ROS2 Object Analytics Release - V0.4.0

0.4.0 (2018-09-7)
------------------
* fully support ros2 implenetation without ros1_bridge connunication
* support object_analytics_rviz on ros2
* splite pointcloud2 to xyz and rgb
* restruct tracking and localization object message type
* optimize localization segmentation implementation
* seperate ncs launch interface
* enable cppcheck and unittest
* support ubuntu 18.04

Source code: [ros2_object_analytics](https://github.com/intel/ros2_object_analytics)

![oa_architecture|690x308](upload://xq1onhkBP5tdtniK42YNcoaZe8J.png) 

---
# ROS2 Object Analytics Release - V0.3.0

(Ref to https://discourse.ros.org/t/ros2-object-analytics-release-v0-3-0/4762)
We are happy to announce the initial release of the ROS2 Object Analytics packages. These packages aim to provide live object analyses over RGB-D camera inputs, same functionalities as its ROS1 counterpart [ROS Objet Analytics ](https://github.com/intel/ros_object_analytics/issues/33). The main features are 2D detection, 2D tracking and 3D localization. Packages and features provided by below 3 projects with tag 
v0.3.0: [ros2_object_analytics ](https://github.com/intel/ros2_object_analytics)
o [object_analytics_node](https://github.com/intel/ros2_object_analytics/tree/master/object_analytics_node): ROS publisher and tests for object tracking in a ROS [Image](https://github.com/ros2/common_interfaces/blob/master/sensor_msgs/msg/Image.msg) message, and for object localization 3D in a ROS PointCloud2 message from an RGB-D camera. OpenCV tracker is adopted for object tracking, with regular rectification from object detection results. Object segmentation over pointcloud2 image locates the detected objects in 3D camera coordination system.
o [object_analytics_msgs](https://github.com/intel/ros2_object_analytics/tree/master/object_analytics_msgs): ROS message interface for the object analytics features
o [object_analytics_launch](https://github.com/intel/ros2_object_analytics/tree/master/object_analytics_launch): ROS launch interface for the overall object analytics and its sub-modules

---
## ROS 1 release:
Ref to [ROS Object Analytics Release - V0.3.0](https://discourse.ros.org/t/ros-object-analytics-release-v0-3-0/3283)





---
[Visit Topic](https://discourse.ros.org/t/ros2-object-analytics-release/5985/1) or reply to this email to respond.




More information about the ros-users mailing list