CHANGELOG

Changelog for package interactive_markers

2.5.4 (2024-03-28)

  • Shorten the length of a lambda. (#106)

  • Contributors: Chris Lalancette

2.5.3 (2023-12-26)

2.5.2 (2023-10-04)

  • Fixed C++20 warning that ‘++’ expression of ‘volatile’-qualified type is deprecated (#102)

  • Contributors: AiVerisimilitude

2.5.1 (2023-07-11)

  • Cleanup of interactive markers (#101)

  • Contributors: Chris Lalancette

2.5.0 (2023-04-28)

2.4.0 (2023-02-14)

  • Update interactive_markers to C++17. (#99)

  • Update maintainers (#98)

  • Mirror rolling to ros2

  • update maintainer (#92)

  • Contributors: Audrow Nash, Chris Lalancette, Dharini Dutia

2.3.2 (2022-04-08)

  • Do not publish if context is invalid during shutdown (#89)

  • Contributors: Jacob Perron

2.3.1 (2022-01-14)

  • Install includes to include/ and misc CMake fixes (#85)

  • Contributors: Shane Loretz

2.3.0 (2021-10-18)

  • Fix deprecation warning introduced after client API update (#83)

  • Fix deprecated sub callback warnings (#84)

  • Include tf2_geometry_msgs.hpp instead of the h file. (#82)

  • Contributors: Abrar Rahman Protyasha, Chris Lalancette, Ivan Santiago Paunovic

2.2.0 (2021-03-18)

  • Cleanup bsd 3 clause license usage (#61)

  • Add missing includes (#81)

  • Contributors: Bjar Ne, Tully Foote

2.1.3 (2020-12-08)

  • Update maintainers (#79)

  • Increase test timeout necessary for Connext (#77)

  • Fix clang warnings (#75)

  • Contributors: Dirk Thomas, Jacob Perron

2.1.2 (2020-06-26)

  • Remove explicit template parameter in spin_until_future_complete (#72)

  • Contributors: Sarthak Mittal

2.1.1 (2020-06-03)

  • export targets in a addition to include directories / libraries (#70)

  • Contributors: Dirk Thomas

2.1.0 (2020-04-30)

  • avoid new deprecations (#69)

  • Merge pull request #60 from ros-visualization/revert-58-bsd3clause_fixup

  • Revert “Cleanup bsd 3 clause license usage”

  • Merge pull request #58 from ros-visualization/bsd3clause_fixup

  • code style only: wrap after open parenthesis if not in one line (#57)

  • Cleanup bsd 3 clause license usage

  • Contributors: Dirk Thomas, Tully Foote, William Woodall

2.0.1 (2019-10-23)

  • Fix test flakes by waiting for pub/sub discovery (#55)

  • Add parameters for QoS of update and feedback topics (#54)

  • Port Python implementation to ROS 2 (#53) * Move Python files to their own directory * Install Python via ament_cmake_python * Make Python implementation ROS 2 compatible * Use docstrings * Minor refactor of callback logic * Guard against None values and KeyError’s * Change insert() signature to take keyword arguments * Rename variables for clarity (e.g. ‘cb’ -> ‘callback’) * Fix PEP 257 errors * Remove unused setup.py * Enable flake8 tests and fix errors * Improve performance * Clear pending updates after applying all of them * Don’t rely on user to apply any pose updates * Expose QoSProfile a parameter * Add Python implementation dependencies to package.xml

  • Contributors: Jacob Perron

2.0.0 (2019-09-26)

  • Add missing visibility macros (#51)

  • Less verbose logging (#45)

  • Rename enums to avoid collisions with MSVC compiler defines (#49)

  • Catch polymorphic exceptions by reference (#48)

  • Port to ROS 2 (#44)
    • Style and other aesthetic changes

    • Use tf2::BufferCoreInterface

    • Replace ‘init’ topic with a ROS service

    • Merge SingleClient logic into InteractiveMarkerClient

    • Remove notion of server ID

    • Add feedback publisher to client

    • Default to C++14 and set stricter compiler flags

    • Fix Windows compiler warnings

    • Remove StateMachine class

    • Fix Clang warnings

  • Contributors: David Gossow, Jacob Perron, Scott K Logan

1.11.4 (2018-04-16)

  • Fixed a crash when updates arrive, or are being processed, while shutdown is called (#36)

  • Contributors: Simon Schmeisser

1.11.3 (2016-08-24)

  • The processFeedback function of the menu handler no longer catches the KeyErrors of the feedback_cb. See: #29

  • Added the empty() and size() members to InteractiveMarkerServer interface. See: #30

  • Contributors: Blake Anderson, Guglielmo Gemignani

1.11.2 (2016-08-24)

  • Fix build when disabling tests with -DCATKIN_ENABLE_TESTING=OFF. See: #26

  • Fix use of uninitialized variables. See: #24

  • Fix potential segfault when shutting down. See: #25

  • Contributors: Alexis Ballier, David Gossow, Max Schwarz

1.11.1 (2014-12-16)

  • Added explicit keyword argument queue_size for publisher in Python code and use the same default queue_size value as C++.

  • Fixed a SEGFAULT in setPose reported in #18 Previously, calling setPose() on an interactive marker causes a SEGFAULT if applyChanges() was not called on the server at least once since the marker was created. I traced the actual SEGFAULT to the doSetPose function. The value of header passed from setPose() is invalid because, in this case, marker_context_it = marker_contexts_.end(). I added a check for this case and, if there is no marker is present, instead use the header from the pending update.

  • Contributors: David Gossow, Mike Koval, William Woodall, ipa-fxm

1.11.0 (2014-02-24)

  • Adding William Woodall as maintainer

  • fix threading bugs Fix locking of data structures shared across threads.

  • Contributors: Acorn Pooley, William Woodall, hersh

1.10.2 (2014-02-03)

  • fix regression in menu_handler.py fixes #14

  • Contributors: William Woodall

1.10.1 (2014-01-27)

  • cleanup python code and package contents

  • remove useless dependencies

  • Contributors: Vincent Rabaud, William Woodall

1.10.0 (2014-01-23)

  • remove debug statement that could produce segfault; init_it->msg->markers may be empty

  • Contributors: Filip Jares