CHANGELOG

Changelog for package moveit_ros_visualization

2.9.0 (2024-01-09)

  • Node logging for the rest of MoveIt (#2599)

  • Node logging in moveit_core (#2503)

  • Use node logging in moveit_ros (#2482)

  • Add new clang-tidy style rules (#2177)

  • Merge branch ‘main’ into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2

  • Converts float to double (#2343) * Limiting the scope of variables #874 Limited the scope of variables in moveit_core/collision_detection * Update moveit_core/collision_detection/src/collision_octomap_filter.cpp Co-authored-by: AndyZe <andyz@utexas.edu> * Update moveit_core/collision_detection/src/collision_octomap_filter.cpp Co-authored-by: AndyZe <andyz@utexas.edu> * Update moveit_core/collision_detection/src/collision_octomap_filter.cpp Co-authored-by: AndyZe <andyz@utexas.edu> * convert float to double * change double to float * Feedback fixes * Introduced variables removed from previous merge commit * Updated GL_Renderer function definitions with double instead of float * Changed update() function arguments to float since it is a derived virtual function and needs to be overriden * Fixed all override errors in visualization * Fixed override errors in perception *Changed reinterpret_cast to double from float* * change variable types to fit function definition * Fixed clang-tidy warnings * Fixed scope of reusable variables ——— Co-authored-by: Salah Soliman <salahsoliman96@gmail.com> Co-authored-by: AndyZe <andyz@utexas.edu> Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Merge branch ‘main’ into dependabot/github_actions/SonarSource/sonarcloud-github-c-cpp-2

  • Contributors: Marq Rasmussen, Sebastian Jahr, Shobuj Paul, Tyler Weaver

2.8.0 (2023-09-10)

  • Remove boost from motion_planning_rviz_plugin (#2308) Co-authored-by: Sebastian Jahr <sebastian.jahr@tuta.io>

  • Replaced numbers with SystemDefaultsQos() (#2271)

  • fix for not having transparency in collision scenes on rviz. (#2242) Co-authored-by: Alp Akgun <samialp.akgun@ocado.com>

  • Contributors: Sami Alperen Akgün, Shobuj Paul, Yang Lin

2.7.4 (2023-05-18)

2.7.3 (2023-04-24)

  • Replace Variable PROJECT_NAME in CMakeLists.txt with the actual name (#2020)

  • Contributors: Shobuj Paul

2.7.2 (2023-04-18)

  • Readability: kinematic_state -> robot_state (#2078)

  • Contributors: Sebastian Jahr

2.7.1 (2023-03-23)

  • Doxygen tag (#1955) * Generate Doxygen Tag * Install tagfile in output directory * Fix problematic override for Doxygen linking

  • remove underscore from public member in MotionPlanResponse (#1939) * remove underscore from private members * fix more uses of the suffix notation

  • Contributors: AlexWebb, Henning Kayser

2.7.0 (2023-01-29)

  • converted characters from string format to character format (#1881)

  • Delete unported moveit_joy visualization demo (#1541)

  • Fix BSD license in package.xml (#1796) * fix BSD license in package.xml * this must also be spdx compliant

  • Minimize use of this-> (#1784) It’s often unnecessary. MoveIt already avoids this in most cases so this PR better cements that existing pattern.

  • Enable -Wold-style-cast (#1770)

  • Migrate to Ogre.h (#1764) * Migrate to Ogre.h * Remove includ for OgreQuaternion.h, included in Ogre.h

  • Remove MOVEIT_LIB_NAME (#1751) It’s more readable and searchable if we just spell out the target name.

  • Add braces around blocks. (#999)

  • Use <> for non-local headers (#1734) Unless a header lives in the same or a child directory of the file including it, it’s recommended to use <> for the #include statement. For more information, see the C++ Core Guidelines item SF.12 https://isocpp.github.io/CppCoreGuidelines/CppCoreGuidelines#sf12-prefer-the-quoted-form-of-include-for-files-relative-to-the-including-file-and-the-angle-bracket-form-everywhere-else

  • Fix clang-tidy issues (#1706) * Blindly apply automatic clang-tidy fixes * Exemplarily cleanup a few automatic clang-tidy fixes * Clang-tidy fixups * Missed const-ref fixups * Fix unsupported non-const -> const * More fixes Co-authored-by: Henning Kayser <henningkayser@picknik.ai>

  • Contributors: AndyZe, Chris Thrasher, Christian Henkel, Cory Crean, Robert Haschke, Sameer Gupta, Stephanie Eng

2.6.0 (2022-11-10)

  • Check valid interactive marker pointer before trying to update pose (#1581)

  • Merge PR #1553: Improve cmake files

  • Use standard exported targets: export_${PROJECT_NAME} -> ${PROJECT_NAME}Targets

  • Improve CMake usage (#1550)

  • Use pragma once as header include guard (#1525)

  • Remove __has_include statements (#1481)

  • Contributors: J. Javan, Robert Haschke, Sebastian Castro, Sebastian Jahr, Vatan Aksoy Tezer

2.5.3 (2022-07-28)

2.5.2 (2022-07-18)

2.5.1 (2022-05-31)

2.5.0 (2022-05-26)

  • Declare the default_planning_pipeline parameter (#1227) Co-authored-by: AndyZe <zelenak@picknik.ai>

  • Merge https://github.com/ros-planning/moveit/commit/72d919299796bffc21f5eb752d66177841dc3442

  • Enable cppcheck (#1224) Co-authored-by: jeoseo <jeongwooseo2012@gmail.com>

  • Make TOTG the default time-parameterization algorithm everywhere (#1218) Co-authored-by: Jafar <cafer.abdi@gmail.com>

  • Make moveit_common a ‘depend’ rather than ‘build_depend’ (#1226)

  • Avoid bind(), use lambdas instead (#1204) Adaption of https://github.com/ros-planning/moveit/pull/3106

  • banish bind() source:https://github.com/ros-planning/moveit/pull/3106/commits/a2911c80c28958c1fce8fb52333d770248c4ec05; required minor updates compared to original source commit in order to ensure compatibility with ROS2

  • Merge https://github.com/ros-planning/moveit/commit/424a5b7b8b774424f78346d1e98bf1c9a33f0e78

  • Remove new operators (#1135) replace new operator with make_shared

  • Merge https://github.com/ros-planning/moveit/commit/a25515b73d682df03ed3eccd839110c296aa79fc

  • Remove include of OgrePrerequisites header (#1099) * Remove OgrePrerequisites include * octomap_render.h includes itself * Include OgrePrerequisites.h

  • Merge https://github.com/ros-planning/moveit/commit/ab42a1d7017b27eb6c353fb29331b2da08ab0039

  • 1.1.9

  • moveit joy: add PS3 dual shock model (#3025) * Added PS3 dual shock * Simplified if-else statements with as one-liners

  • Compilation fixes for Jammy and bring back Rolling CI (#1095) * Use jammy dockers and clang-format-12 * Fix unused depend, and move to python3-lxml * add ompl to repos, fix versions and ogre * Remove ogre keys * Fix boolean node operator * Stop building dockers on branch and fix servo null pointer * update pre-commit to clang-format-12 and pre-commit fixes * clang-format workaround and more pre-commit fixes

  • Add option to use simulation time for rviz trajectory display (#3055)

  • Fix object interactive marker in wrong pose after changing the fixed frame (#680)

  • Merge https://github.com/ros-planning/moveit/commit/0d7462f140e03b4c319fa8cce04a47fe3f650c60

  • 1.1.8

  • Remove unused parameters. (#1018) Co-authored-by: Tyler Weaver <tyler@picknik.ai> Co-authored-by: Vatan Aksoy Tezer <vatan@picknik.ai>

  • 1.1.7

  • Move MoveItErrorCode class to moveit_core (#3009) … reducing code duplication and facilitating re-use

  • RobotState::attachBody: Migrate to unique_ptr argument (#3011) … to indicate transfer of ownership and simplify pointer handling

  • Merge PR #2925: Fix “ClassLoader: SEVERE WARNING” on reset of MPD Resetting the MotionPlanningDisplay in rviz (or disabling+enabling it) issues a warning, because the IK plugin is unloaded (when resetting the RobotModelLoader) while there are still pending references to the RobotModel.

  • Remove all remaining usage of robot_model

  • Merge #2944: various fixes to the rviz plugins

  • Switch to std::bind (#2967) * boost::bind -> std::bind grep -rlI –exclude-dir=.git “boost::bind” | xargs sed -i ‘s/boost::bind/std::bind/g’ * Convert bind placeholders grep -rlI –exclude-dir=.git “ _[0-9]” | xargs sed -i ‘s/ _([0-9])/ std::placeholders::_1/g’ * Update bind include header grep -rlI –exclude-dir=.git “boost/bind” | xargs sed -i ‘s#boost/bind.hpp#functional#’

  • MPD: Avoid flickering of the progress bar The progress bar shows the number of pending background jobs. If there is only one job pending, the progress bar is shown and immediately hidden as soon as the process is finished. Thus, we shouldn’t show the progress bar if there is only one job and thus no actual progress to show. Use the default size and color scheme.

  • Joints widget: avoid flickering of the nullspace slider Show a (disabled) dummy slider if there is no nullspace. This avoids flickering between zero and one slider, which is the most common case. Also provide some tooltips to explain the usage.

  • 1.1.6

  • Fix MotionPlanningFrame’s namespace handling (#2922) * waitForAction(): remove NodeHandle argument * The NodeHandle was just for NodeHandle::ok(), which can be handled by ros::ok() as well. * Fix initialization of params, etc. that depend on MoveGroupNS * When the MoveGroupNS has changed, we should re-initialize all these params, subscribers, and topics. Thus having them in a central place is helpful ;-) * Fix namespaces as pointed out by @v4hn * Simplify nh_ naming * update comments

  • Fix ClassLoader: SEVERE WARNING Clear all references to RobotModel before destroying the corresponding RobotModelLoader.

  • Modernize: std::make_shared

  • Contributors: Abishalini, AndyZe, Cory Crean, Henning Kayser, Jafar, Jafar Abdi, JafarAbdi, Job van Dieten, Jochen Sprickerhof, Martin Oehler, Robert Haschke, Sencer Yazıcı, Stephanie Eng, Vatan Aksoy Tezer, jeoseo, pvanlaar, v4hn

2.4.0 (2022-01-20)

  • Move background_processing (#997)

  • Merge https://github.com/ros-planning/moveit/commit/f3ac6070497da90da33551fc1dc3a68938340413

  • Merge https://github.com/ros-planning/moveit/commit/a0ee2020c4a40d03a48044d71753ed23853a665d

  • moveit_build_options() Declare common build options like CMAKE_CXX_STANDARD, CMAKE_BUILD_TYPE, and compiler options (namely warning flags) once. Each package depending on moveit_core can use these via moveit_build_options().

  • MPD: do not save/restore warehouse parameters (#2865) If we reload these values from the config, setting the ROS parameters is much less useful. At least the type of warehouse_ros plugin (mongo or sqlite) cannot be selected in the display, so you will probably need to meddle with the parameters anyway if you want to connect to a different db. search for parameters warehouse_host/port because they are usually set at the top level, but you might want to set them differently for different move_groups.

  • PlanningSceneDisplay: always update the main scene node’s pose (#2876)

  • Contributors: Abishalini, Michael Görner, Robert Haschke, Tyler Weaver

2.3.2 (2021-12-29)

2.3.1 (2021-12-23)

  • Convert to modern include guard #882 (#891)

  • Replaced C-Style Cast with C++ Style Cast. (#935)

  • Add codespell to precommit, fix A LOT of spelling mistakes (#934)

  • Get rid of “std::endl” (#918)

  • changed post-increments in loops to preincrements (#888)

  • Latched Strings for URDF and SRDF (#765)

  • Consider simulated time (#883)

  • Enforce package.xml format 3 Schema (#779)

  • Update Maintainers of MoveIt package (#697)

  • Reduce log verbosity, improved info message (#714)

  • Fix Python2: convert keys() into list (#2862)

  • MP panel: fix order of input widgets for shape size (#2847)

  • Makes rviz trajectory visualization topic relative (#2835)

  • MotionPlanningFrame: Gracefully handle undefined parent widget (#2833)

  • more fixes for the clang-tidy job (#2813)

  • clang-tidy: modernize-make-shared, modernize-make-unique (#2762)

  • Contributors: Dave Coleman, David V. Lu!!, Felix von Drigalski, Gaël Écorchard, Henning Kayser, Kaustubh, Michael Görner, Parthasarathy Bana, Rick Staa, Robert Haschke, Sencer Yazıcı, Yuri Rocha, lorepieri8, predystopic-dev, pvanlaar

2.3.0 (2021-10-08)

  • Support passing MoveGroup’s namespace to MoveGroupInterface (#533)

  • Add getSharedRobotModelLoader to fix race condition when having multiple displays for the same node (#525)

  • Make TF buffer & listener in PSM private (#654) * Add private buffer & tf listener to PSM * Remove coupled deleter * Decouple PSM from CSM * Deprecate old constructors

  • mesh_shape: Fix resource group for meshes (#672)

  • Fix warnings in Galactic and Rolling (#598) * Use __has_includes preprocessor directive for deprecated headers * Fix parameter template types * Proper initialization of smart pointers, rclcpp::Duration

  • Add option to disable Octomap in Rviz Rendering Tools (#606)

  • Fixes for Windows (#530)

  • Support arbitrary realtime-factors in trajectory visualization (#2745)

  • Fix joints tab

  • MP frame: Fix handling of mimic + passive joints

  • Switch order of manipulation and joints tab

  • Fix trajectory panel (#2737) * TrajectoryPanel: Only set paused_ via pauseButton() to keep “Pause/Play” button in correct state * simplify code on the side

  • moveit_joy: RuntimeError: dictionary changed size during iteration (#2628)

  • Contributors: AdamPettinger, Akash, Henning Kayser, Jafar Abdi, Michael Görner, Nisala Kalupahana, Jorge Nicho, Henning Kayser, Robert Haschke, Vatan Aksoy Tezer, Tyler Weaver, Lior Lustgarten

2.2.1 (2021-07-12)

2.2.0 (2021-06-30)

2.1.4 (2021-05-31)

2.1.3 (2021-05-22)

2.1.2 (2021-04-20)

  • Fix robot_model & moveit_ros_visualization dependencies (#421)

  • Remove move_group namespace from MotionPlanning display (#420)

  • Contributors: Jafar Abdi, Vatan Aksoy Tezer

2.1.1 (2021-04-12)

2.1.0 (2020-11-23)

  • [fix] Interactive markers not visible in motion planning plugin (#299)

  • [maint] Wrap common cmake code in ‘moveit_package()’ macro (#285) * New moveit_package() macro for compile flags, Windows support etc * Add package ‘moveit_common’ as build dependency for moveit_package() * Added -Wno-overloaded-virtual compiler flag for moveit_ros_planners_ompl

  • [maint] Compilation fixes for macOS (#271)

  • [ros2-migration] Port moveit_ros_warehouse to ROS 2 (#273)

  • [ros2-migration] Port trajectory_rviz_plugin to ROS 2 (#201)

  • Contributors: Henning Kayser, Jafar Abdi, Lior Lustgarten, Mark Moll, Yu Yan, Edwin Fan

2.0.0 (2020-02-17)

  • [fix] moveit_ros_visualization fixes (#168) * robot_state_display: Fix empty robot description field * planning scene plugin: Fix destroySceneNode

  • [fix] Fix moveit_ros_visualization (#167)

  • [port] Port moveit ros visualization to ROS 2 (#160)

  • [port] Port rdf_loader to ROS2 (#104)

  • Contributors: Henning Kayser, Jafar Abdi

1.1.1 (2020-10-13)

  • [feature] Clean up Rviz Motion Planning plugin, add tooltips (#2310)

  • [fix] “Clear Octomap” button, disable when no octomap is published (#2320)

  • [fix] clang-tidy warning (#2334)

  • [fix] python3 issues (#2323)

  • [maint] Cleanup MSA includes (#2351)

  • [maint] Add comment to MOVEIT_CLASS_FORWARD (#2315)

  • Contributors: Felix von Drigalski, Michael Görner, Robert Haschke

1.1.0 (2020-09-04)

1.0.6 (2020-08-19)

  • [feature] MP display: add units to joints tab (#2264)

  • [feature] Allow adding planning scene shapes from rviz panel (#2198)

  • [feature] Default to Planning tab initially (#2061)

  • [fix] Fix deferred robot model loading (#2245)

  • [maint] Migrate to clang-format-10

  • [maint] Optimize includes (#2229)

  • Contributors: Jorge Nicho, Markus Vieth, Michael Görner, Robert Haschke, Michael Görner

1.0.5 (2020-07-08)

  • [feature] Improve rviz GUI to add PlanningScene objects. Ask for scaling large meshes. (#2142)

  • [maint] Replace robot_model and robot_state namespaces with moveit::core (#2135)

  • [maint] Fix catkin_lint issues (#2120)

  • [feature] PlanningSceneDisplay speedup (#2049)

  • [feature] Added support for PS4 joystick (#2060)

  • [fix] MP display: planning attempts are natural numbers (#2076, #2082)

  • Contributors: Felix von Drigalski, Henning Kayser, Jafar Abdi, Michael Görner, Robert Haschke, Simon Schmeisser, TrippleBender

1.0.4 (2020-05-30)

1.0.3 (2020-04-26)

  • [fix] MotionPlanningDisplay: change internal shortcut Ctrl+R to Ctrl+I (#1967)

  • [fix] Remove PlanningSceneInterface from rviz display, but use its PlanningSceneMonitor instead

  • [fix] Fix segfault in RobotStateVisualization (#1941)

  • [feature] Provide visual feedback on success of requestPlanningSceneState()

  • [feature] Wait for get_planning_scene in background (#1934)

  • [feature] Reduce step size for pose-adapting widgets

  • [fix] Reset scene_marker when disabling motion planning panel

  • [fix] Enable/disable motion planning panel with display

  • [fix] Enable/disable pose+scale group box when collision object is selected/deselected

  • [fix] Correctly populate the list of scene objects in the motion planning panel

  • [feature] Resize scene marker with collision object

  • [feature] Show attached bodies in trajectory trail (#1766)

  • [fix] Fix REALTIME trajectory playback (#1683)

  • [maint] Apply clang-tidy fix to entire code base (#1394)

  • [maint] Notice changes in rviz planning panel requiring saving (#1991)

  • [maint] Fix errors: catkin_lint 1.6.7 (#1987)

  • [maint] Improve Python 3 compatibility (#1870) * Replaced StringIO with BytesIO for python msg serialization * Use py_bindings_tools::ByteString as byte-based serialization buffer on C++ side

  • [maint] Windows build: Fix binary artifact install locations. (#1575)

  • [maint] Use CMAKE_CXX_STANDARD to enforce c++14 (#1607)

  • [fix] Fix pruning of enclosed nodes when rendering octomap in RViz (#1685)

  • [fix] Fix missing scene_manager initialization in OcTreeRender’s constructor (#1817)

  • [feature] new Joints tab in RViz motion panel (#1308)

  • [feature] Add <previous> robot state to RViz motion panel (#1742)

  • Contributors: Bjar Ne, Dale Koenig, MarqRazz, Max Krichenbauer, Michael Görner, Robert Haschke, RyodoTanaka, Sean Yen, Takara Kasai, Yannick Jonetzko, Yu, Yan, v4hn

1.0.2 (2019-06-28)

  • [maintenance] Removed unnecessary null pointer checks on deletion (#1410)

  • Contributors: Mahmoud Ahmed Selim

1.0.1 (2019-03-08)

  • [improve] Apply clang tidy fix to entire code base (Part 1) (#1366)

  • Contributors: Isaac Robert Haschke, Yu, Yan

1.0.0 (2019-02-24)

  • [fix] catkin_lint issues (#1341)

  • Contributors: Dave Coleman, Robert Haschke

0.10.8 (2018-12-24)

  • [fix] Handle exceptions in rviz plugins (#1267)

  • Contributors: Christian Rauch, Robert Haschke

0.10.7 (2018-12-13)

0.10.6 (2018-12-09)

  • [enhancement] Add check box for CartesianPath planning (#1238)

  • [enhancement] Improve MotionPlanning panel (#1198) * Allow selection of planning group in planning panel * Choose start and goal state directly from combobox

  • [fix] rviz crash when changing the planning group while executing (#1198)

  • [fix] Fix several issues in rendering of attached bodies (#1199) * Show / hide attached body together with robot * Force PlanningScene rendering on enable * Link SceneDisplay’s attached-body-color to TrajectoryVisualization’s one

  • [maintenance] Replaced Eigen::Affine3d -> Eigen::Isometry3d (#1096)

  • [maintenance] Use C++14 (#1146)

  • [maintenance] Cleanup Robot Interaction (#1194) * Postpone subscription to trajectory topic * Fix memory leaks

  • [maintenance] Simplify shared tf2 buffer usage (#1196)

  • [maintenance] Code Cleanup (#1179)

  • Remove obsolete eigen_conversions dependency (#1181)

  • Contributors: Alex Moriarty, Benjamin Scholz, Dave Coleman, Kei Okada, Michael Görner, Robert Haschke, Sven Krause

0.10.5 (2018-11-01)

0.10.4 (2018-10-29)

0.10.3 (2018-10-29)

  • [maintenance] Store more settings of rviz’ PlanningFrame (#1135)

  • [maintenance] Lint visualization (#1144)

  • Contributors: Alexander Gutenkunst, Dave Coleman

0.10.2 (2018-10-24)

  • [fix] build issue in boost/thread/mutex.hpp (#1055)

  • [fix] optional namespace args (#929)

  • [maintenance] Python3 support (#1103, #1054)

  • [maintenance] add minimum required pluginlib version (#927)

  • Contributors: Michael Görner, Mikael Arguedas, Mohmmad Ayman, Robert Haschke, Timon Engelke, mike lautman

0.10.1 (2018-05-25)

  • [maintenance] migration from tf to tf2 API (#830)

  • [feature] rviz plugin: set start/goal RobotState from external (#823) - /rviz/moveit/update_custom_start_state - /rviz/moveit/update_custom_goal_state stopping from external: - /rviz/moveit/stop

  • [feature] namespace capabilities for moveit_commander (#835)

  • [fix] consider shape transform for OcTree

  • [fix] realtime trajectory display (#761)

  • Contributors: Alexander Rössler, Dave Coleman, Ian McMahon, Mikael Arguedas, Pan Hy, Phy, Robert Haschke, Will Baker

0.9.11 (2017-12-25)

0.9.10 (2017-12-09)

  • [fix] don’t crash on empty robot_description in RobotState plugin #688

  • [fix] RobotState rviz previewer: First message from e.g. latching publishers is not applied to robot state correctly (#596)

  • [doc] Document auto scale in Rviz plugin (#602)

  • Contributors: Dave Coleman, Isaac I.Y. Saito, Simon Schmeisser, axelschroth

0.9.9 (2017-08-06)

  • [fix] RobotStateVisualization: clear before load to avoid segfault #572

  • Contributors: v4hn

0.9.8 (2017-06-21)

  • [fix] TrajectoryVisualization crash if no window_context exists (#523, #525)

  • [fix] robot display: Don’t reload robot model upon topic change (Fixes #528)

  • [build] add Qt-moc guards for boost 1.64 compatibility (#534)

  • [enhance] rviz display: stop trajectory visualization on new plan. Fixes #526 (#531, #510).

  • Contributors: Isaac I.Y. Saito, Simon Schmeisser, Yannick Jonetzko, henhenhen, v4hn

0.9.7 (2017-06-05)

  • [capability] New panel with a slider to control the visualized trajectory (#491) (#508)

  • [fix] Build for Ubuntu YZ by adding BOOST_MATH_DISABLE_FLOAT128 (#505)

  • Contributors: Dave Coleman, Mikael Arguedas

0.9.6 (2017-04-12)

  • [fix] RViz plugin some cosmetics and minor refactoring #482

  • [fix] rviz panel: Don’t add object marker if the wrong tab is selected #454

  • [improve] RobotState display [kinetic] (#465)

  • Contributors: Jorge Nicho, Michael Goerner, Yannick Jonetzko

0.9.5 (2017-03-08)

  • [fix] correct “simplify widget handling” #452 This reverts “simplify widget handling (#442)”

  • [fix][moveit_ros_warehouse] gcc6 build error #423

  • [enhancement] Remove “catch (…)” instances, catch std::exception instead of std::runtime_error (#445)

  • Contributors: Bence Magyar, Dave Coleman, Isaac I.Y. Saito, Yannick Jonetzko

0.9.4 (2017-02-06)

  • [fix] race conditions when updating PlanningScene (#350)

  • [enhancement] Add colours to trajectory_visualisation display (#362)

  • [maintenance] clang-format upgraded to 3.8 (#367)

  • Contributors: Bence Magyar, Dave Coleman, Robert Haschke

0.9.3 (2016-11-16)

  • [maintenance] Updated package.xml maintainers and author emails #330

  • Contributors: Dave Coleman, Ian McMahon

0.9.2 (2016-11-05)

  • [Maintenance] Auto format codebase using clang-format (#284)

  • Contributors: Dave Coleman

0.6.6 (2016-06-08)

  • cleanup cmake tests, fix empty output

  • added missing rostest dependency (#680), fixes c6d0ede (#639)

  • [moveit joy] Add friendlier error message

  • relax Qt-version requirement Minor Qt version updates are ABI-compatible with each other: https://wiki.qt.io/Qt-Version-Compatibility

  • replaced cmake_modules dependency with eigen

  • [jade] eigen3 adjustment

  • always (re)create collision object marker other properties than pose (such as name of the marker) need to be adapted too

  • use getModelFrame() as reference frame for markers

  • moved “Publish Scene” button to “Scene Objects” tab previous location on “Context” tab was weird

  • cherry-pick PR #635 from indigo-devel

  • unify Qt4 / Qt5 usage across cmake files - fetch Qt version from rviz - define variables/macros commonly used for Qt4 and Qt5 - QT_LIBRARIES - qt_wrap_ui()

  • leave frame transforms to rviz The old code (1.) reimplemented frame transforms in rviz although it could simply utilize rviz’ FrameManager (2.) assumed the transform between the model-frame and the fixed_frame was constant and only needed to be updated if the frame changes (ever tried to make the endeffector your fixed frame?) (3.) was broken because on startup calculateOffsetPosition was called before the robot model is loaded, so the first (and usually only) call to calculateOffsetPosition failed. Disabling/Enabling the display could be used to work around this… This fixes all three issues.

  • display planned path in correct rviz context This was likely a typo.

  • Solved parse error with Boost 1.58. Fixes #653

  • Enable optional build against Qt5, use -DUseQt5=On to enable it

  • explicitly link rviz’ default_plugin library The library is not exported anymore and now is provided separately from rviz_LIBRARIES. See https://github.com/ros-visualization/rviz/pull/979 for details.

  • merge indigo-devel changes (PR #633 trailing whitespace) into jade-devel

  • Removed trailing whitespace from entire repository

  • correctly handle int and float parameters Try to parse parameter as int and float (in that series) and use IntProperty or FloatProperty on success to have input checking. Floats formatted without decimal dot, e.g. “0”, will be considered as int! All other parameters will be handled as string.

  • access planner params in rviz’ MotionPlanningFrame

  • new method MoveGroup::getDefaultPlannerId(const std::string &group) … to retrieve default planner config from param server moved corresponding code from rviz plugin to MoveGroup interface to facilitate re-use

  • correctly initialize scene robot’s parameters after initialization - loaded parameters were ignored - changed default alpha value to 1 to maintain previous behaviour

  • load default_planner_config from default location instead of loading from /<ns>/default_planner_config, use /<ns>/move_group/<group>/default_planner_config, which is the default location for planner_configs too

  • Merge pull request #610: correctly update all markers after robot motion

  • fixing conflicts, renaming variable

  • Merge pull request #612 from ubi-agni/interrupt-traj-vis interrupt trajectory visualization on arrival of new display trajectory

  • cherry-picked PR #611: fix segfault when disabling and re-enabling TrajectoryVisualization

  • cherry-picked PR #609: load / save rviz’ workspace config

  • added missing initialization

  • correctly setAlpha for new trail

  • fixed race condition for trajectory-display interruption

  • cleanup TrajectoryVisualization::update simplified code to switch to new trajectory / start over animation in loop mode

  • new GUI property to allow immediate interruption of displayed trajectory

  • immediately show trajectory after planning (interrupting current display)

  • fix segfault when disabling and re-enabling TrajectoryVisualization

  • update pose of all markers when any marker moved Having several end-effector markers attached to a group (e.g. a multi- fingered hand having an end-effector per fingertip and an end-effector for the hand base), all markers need to update their pose on any motion of any marker. In the example: if the hand base is moved, the fingertip markers should be moved too.

  • use move_group/default_workspace_bounds as a fallback for workspace bounds

  • code style cleanup

  • fixed tab order of rviz plugin widgets

  • load / save rviz’ workspace config

  • saves robot name to db from moveit. also robot name accessible through robot interface python wrapper

  • Added install rule to install moveit_joy.py.

  • motion_planning_frame_planning: use /default_planner_config parma to specify default planning algorithm

  • Avoid adding a slash if getMoveGroupNS() is empty. If the getMoveGroupNS() returns an empty string, ros::names::append() inserts a slash in front of ‘right’, which changes it to a global name. Checking getMoveGroupNS() before calling append removes the issue. append() behaviour will not be changed in ros/ros_comm.

  • Contributors: Ammar Najjar, Dave Coleman, Isaac I.Y. Saito, Jochen Welle, Kei Okada, Michael Ferguson, Michael Görner, Robert Haschke, Sachin Chitta, Simon Schmeisser (isys vision), TheDash, Thomas Burghout, dg, v4hn

0.6.5 (2015-01-24)

  • update maintainers

  • Created new trajectory display, split from motion planning display

  • Added new trajectory display inside of motion planning display

  • Fix bug with alpha property in trajectory robot

  • Optimized number of URDFs loaded

  • Changed motion planning Rviz icon to MoveIt icon

  • Add time factor support for iterative_time_parametrization

  • Contributors: Dave Coleman, Michael Ferguson, kohlbrecher

0.6.4 (2014-12-20)

0.6.3 (2014-12-03)

  • fix duplicate planning attempt box, also fix warning about name

  • Contributors: Michael Ferguson

0.6.2 (2014-10-31)

0.6.1 (2014-10-31)

  • Fixed joystick documentation

  • Joystick documentation and queue_size addition

  • Contributors: Dave Coleman

0.6.0 (2014-10-27)

  • Added move_group capability for clearing octomap.

  • Fix coding style according to the moveit style

  • Better user output, kinematic solver error handling, disclaimer

  • Remove sample launch file for joystick and update joystick python script. 1) Use moveit-python binding to parse SRDF. 2) Make the speed slower to control the marker from joystick. 3) Change joystick button mapping to be suitable for the users.

  • Update joystick documentation and rename the the launch file for joy stick program. Shorten the message the check box to toggle communication with joy stick script.

  • add checkbox to toggle if moveit rviz plugin subscribes the topics to be used for communication to the external ros nodes. update moveit_joy.py to parse srdf to know planning_groups and the names of the end effectors and support multi-endeffector planning groups.

  • motion_planning_rviz_plugin: add move_group namespace option This allows multiple motion_planning_rviz_plugin / planning_scene_rviz_plugin to be used in RViz and connect to differently-namespaced move_group nodes.

  • moved planning_attempts down one row in gui to maintain gui width

  • Added field next to planning_time for planning_attempts Now, ParallelPlanner terminates either due to timeout, or due to this many attempts. Note, that ParallelPlanner run’s Dijkstra’s on all the nodes of all the sucessful plans (hybridize==true).

  • adding PoseStamped topic to move the interactive marker from other ros nodes such as joystick programs.

  • motion_planning_rviz_plugin: add move_group namespace option This allows multiple motion_planning_rviz_plugin / planning_scene_rviz_plugin to be used in RViz and connect to differently-namespaced move_group nodes.

  • Contributors: Chris Lewis, Dave Coleman, Dave Hershberger, Jonathan Bohren, Ryohei Ueda, Sachin Chitta

0.5.19 (2014-06-23)

  • Changed rviz plugin action server wait to non-simulated time

  • Fix [-Wreorder] warning.

  • Fix RobotState rviz plugin to not display when disabled

  • Add check for planning scene monitor connection, with 5 sec delay

  • Contributors: Adolfo Rodriguez Tsouroukdissian, Dave Coleman

0.5.18 (2014-03-23)

  • add pkg-config as dep

  • find PkgConfig before using pkg_check_modules PC specific functions mustn’t be used before including PkgConfig

  • Contributors: Ioan Sucan, v4hn

0.5.17 (2014-03-22)

  • update build system for ROS indigo

  • update maintainer e-mail

  • Contributors: Ioan Sucan

0.5.16 (2014-02-27)

  • back out problematic ogre fixes

  • robot_interaction: split InteractionHandler into its own file

  • Switched from isStateColliding to isStateValid

  • Changed per PR review

  • Clean up debug output

  • Added ability to set a random <collision free> start/goal position

  • Merge branch ‘hydro-devel’ of https://github.com/ros-planning/moveit_ros into acorn_rviz_stereo

  • rviz: prepare for Ogre1.10

  • Contributors: Acorn Pooley, Dave Coleman

0.5.14 (2014-02-06)

0.5.13 (2014-02-06)

  • remove debug printfs

  • planning_scene_display: use requestPlanningSceneState() Get current planning scene state when planning scene display is enabled and/or model is loaded.

  • Fix Parse error at “BOOST_JOIN” error See: https://bugreports.qt-project.org/browse/QTBUG-22829

  • Contributors: Acorn Pooley, Benjamin Chretien

0.5.12 (2014-01-03)

0.5.11 (2014-01-03)

  • Added back-link to tutorial and updated moveit website URL.

  • Ported MoveIt RViz plugin tutorial to sphinx.

  • Contributors: Dave Hershberger

0.5.10 (2013-12-08)

0.5.9 (2013-12-03)

  • correcting maintainer email

  • Fixed an occasional crash bug in rviz plugin caused by gui calls in non-gui thread.

  • Added planning feedback to gui, refactored states tab

  • Stored states are auto loaded when warehouse database is connected

0.5.8 (2013-10-11)

  • Added option to rviz plugin to show scene robot collision geometry

0.5.7 (2013-10-01)

0.5.6 (2013-09-26)

0.5.5 (2013-09-23)

  • Fix crash when the destructor is called before onInitialize

  • remove call for getting the combined joint limits of a group

  • bugfixes

  • porting to new RobotState API

  • use new helper class from rviz for rendering meshes

0.5.4 (2013-08-14)

  • Added manipulation tab, added plan id to manipulation request

  • make headers and author definitions aligned the same way; white space fixes

  • using action client for object recognition instead of topic

  • move background_processing lib to core

  • display collision pairs instead of simply colliding links

0.5.2 (2013-07-15)

0.5.1 (2013-07-14)

0.5.0 (2013-07-12)

  • fix #275

  • white space fixes (tabs are now spaces)

0.4.5 (2013-07-03)

0.4.4 (2013-06-26)

  • remove root_link_name property

  • add status tab to Rviz plugin