CHANGELOG

Changelog for package aruco_opencv

5.2.1 (2024-06-04)

  • Fix out of bounds indexes when retrieving camera matrix for rectified images (#47) (#48) * Add image_is_rectified parameter to example yaml config

  • Contributors: Błażej Sowa, Sandip Das

5.2.0 (2024-05-08)

  • Use post-set parameters callback (#41) (#42)

  • Add missing detection parameters (backport #38) (#40) * Populate default aruco parameter values from OpenCV library * Add detectInvertedMarker parameter * Add descriptions to aruco parameters in yaml file * Add option to generate inverted markers * Add Aruco3 detection parameters

  • Remove boards on node cleanup (#35) (#37)

  • Fix compatibility with OpenCV ^4.7.0 (backport #32) (#34)

  • Contributors: Błażej Sowa

5.1.0 (2024-04-02)

  • Add an option to subscribe to compressed image topics. (#28) (#29)

  • Contributors: Ray Ferric

5.0.0 (2023-05-18)

4.1.0 (2023-02-22)

  • Add python dependencies (#19)

  • Add board detection (ROS2) (#16) * Rename SingleMarkerTracker to ArucoTracker * Add BoardPose msg, change MarkerDetection to ArucoDetection * Change default marker dictionary * Add board descriptions * Add board pose estimation * Fix cpplint errors

  • Add scripts for generating markers and boards (#13)

  • Ignore duplicate image frames (#10)

  • Add ament_lint tests to cmakelists instead of github workflows (#7)

  • Contributors: Błażej Sowa

4.0.1 (2022-12-13)

4.0.0 (2022-12-12)

  • Better camera calibration handling (#3) * Support different distortion models * Support rectified images

  • Use newer headers for cv_bridge

  • Use the custom QoS for image subscription

  • Fix autostart node activation

  • Use newer headers for tf2_geometry_msgs

  • Fix aruco library linking

  • Fix build for Humble

  • Remove image_transport parameter

  • Add marker_dict parameter

  • Unsubscribe from image topic on shutdown

  • Add single_marker_tracker_autostart node

  • Reformat code with uncrustify

  • Use cv::parallel_for_ in PnP pose computation

  • Refactor parameter declaration and retrieval, add utils.hpp

  • Initial LifecycleNode implementation

  • Update project dependencies

  • Add copyright notice

  • Install config directory

  • Port launch and config file to ROS2

  • Remove old dynamic reconfigure config

  • Declare the rest of the parameters

  • Initial port for ROS2 Foxy

  • Simplify filling the camera matrix from camera info

  • Contributors: Błażej Sowa

0.2.0 (2022-09-07)

  • Move message definitions to aruco_opencv_msgs package (#2)

  • Fix build for Debian Buster

  • Publish transforms from output_frame to markers on tf2

  • Transform marker poses to specified output frame

  • Allow changing camera info without restarting the tracker

  • Add dynamically reconfigurable parameters for corner refinement

  • Contributors: Błażej Sowa

0.1.0 (2022-07-07)

  • Initial version of the package

  • Contributors: Błażej Sowa