diff --git a/capabilities/CHANGELOG.rst b/capabilities/CHANGELOG.rst index 1d1f57f5..2a687a89 100644 --- a/capabilities/CHANGELOG.rst +++ b/capabilities/CHANGELOG.rst @@ -2,6 +2,33 @@ Changelog for package moveit_task_constructor_capabilities ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +0.1.4 (2025-10-15) +------------------ +* Replace deprecated ament_target_dependencies() +* Migrate to new arguments for static_transform_publisher +* Add missing include fmt/ranges.h (`#712 `_) +* Reset preempt_request after canceling execution (`#689 `_) +* Let Task::preempt() cancel execute() (`#684 `_) +* Add missing include fmt/ranges.h (`#712 `_) +* Provide action feedback during task execution (`#653 `_) +* Use .hpp headers (`#641 `_) +* Silent error "Found empty JointState message" +* Simplify formatting code with https://github.com/fmtlib (`#499 `_) +* Print warning if no controllers are configured for trajectory execution (`#514 `_) +* Fix Solution::fillMessage() (`#432 `_) +* Add property trajectory_execution_info (`#355 `_, `#502 `_) +* ExecuteTaskSolutionCapability: Reject new goals when busy (`#496 `_) +* ExecuteTaskSolutionCapability: Rename goalCallback() -> execCallback() +* Replace namespace robot\_[model|state] with moveit::core +* Use pluginlib consistently (`#463 `_) +* remove underscore from public members in MotionPlanResponse (`#426 `_) +* Rely on CXXFLAGS definition from moveit_common package +* Fix compiler warnings +* Alphabetize package.xml's and CMakeLists +* execute_task_solution_capability: check for canceling request before canceling the goal handle (`#321 `_) +* ROS 2 Migration (`#170 `_) +* Contributors: AndyZe, Cihat Kurtuluş Altıparmak, Dhruv Patel, Henning Kayser, Jafar Abdi, JafarAbdi, Marq Rasmussen, Michael Görner, Peter David Fagan, Robert Haschke, Sebastian Jahr + 0.1.3 (2023-03-06) ------------------ diff --git a/capabilities/package.xml b/capabilities/package.xml index dfcd5a75..925d26ea 100644 --- a/capabilities/package.xml +++ b/capabilities/package.xml @@ -1,6 +1,6 @@ moveit_task_constructor_capabilities - 0.1.3 + 0.1.4 MoveGroupCapabilites to interact with MoveIt diff --git a/core/CHANGELOG.rst b/core/CHANGELOG.rst index ae0c53b3..64b1489c 100644 --- a/core/CHANGELOG.rst +++ b/core/CHANGELOG.rst @@ -2,6 +2,121 @@ Changelog for package moveit_task_constructor_core ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +0.1.4 (2025-10-15) +------------------ +* Simplify include of tf2_eigen.hpp +* Avoid duplicate scenes in Solution.msg from generator stages (`#639 `_) +* Allow max Cartesian link speed in PlannerInterface (`#277 `_) +* Replace deprecated ament_target_dependencies() +* Enable collisions visualizations (`#708 `_) +* LimitSolutions wrapper stage (`#710 `_) +* Improve code documentation +* CI: Fix Noble builds +* Pick with custom max_velocity_scaling_factor during approach+lift +* Modernize declaration of compile options +* Factor out Python property handling to allow for reuse in custom Python wrappers +* Let Task::preempt() cancel execute() (`#684 `_) +* Fix clamping of joint constraints (`#665 `_) +* Correctly report failures instead of issueing console warnings +* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04 +* Python API: Allow passing a task's introspection object to SolutionBase::toMsg() +* clang-format-14 +* Use .hpp headers (`#641 `_) +* Add support for GenerateRandomPose +* python: Add Task::setRobotModel +* Add path_constraints property to Connect stage +* provide a fmt wrapper (`#615 `_) +* Update API: JumpThreshold -> CartesianPrecision (`#611 `_) +* Reduce stop time due to preempt (`#598 `_) +* Add unittest for `#581 `_ +* Fix early planning preemption (`#597 `_) +* MoveRelative: fix segfault on empty trajectory (`#595 `_) +* MoveRelative: handle equal min/max distance (`#593 `_) +* CI: skip python tests +* Adapt python scripts to ROS2 API changes +* Reenable python bindings +* Cleanup unit tests and allow them to run via both, cmdline and pytest +* Connect: Relax validity check of reached end state +* Unify Python demo scripts +* Switch shebang to python3 +* Silence gcc's overloaded-virtual warnings +* Fix flaky IK in asan unit test: increase timeout +* Fix failing unittests: remove static executor +* Add property to enable/disable pruning at runtime (`#590 `_) +* Disable pruning by default +* test_pruning.cpp: Add new test +* test_pruning.cpp: Extend test to ParallelContainer +* PassThrough: cleanup unused headers +* Avoid segfault if TimeParameterization is not set +* CartesianPath: allow ik_frame definition if start and end are given as joint-space poses +* Generalize utils::getRobotTipForFrame() to return error_msg instead of calling markAsFailure() on a solution +* ComputeIK: Allow additional constraints for filtering solutions (`#464 `_) +* Expose MultiPlanner to Python (`#474 `_) +* Add unittest cartesianCollisionMinMaxDistance (`#538 `_) +* Connect: Relax validity check of reached end state (`#542 `_) +* Simplify formatting code with https://github.com/fmtlib (`#499 `_) +* Add NoOp stage (`#534 `_) +* ModifyPlanningScene: check state for collisions +* Improve TypeError exceptions +* Switch to package py_binding_tools +* Add ability to move CollisionObjects (`#567 `_) +* Simplify rclcpp::Node creation +* Improve description of max_distance property of Connect stage (`#564 `_) +* Add Generator::spawn(from, to, trajectory) variant (`#546 `_) +* Cosmetic fixes +* Fix Solution::fillMessage() (`#432 `_) +* Fix generation of Solution msg: consider backward operation +* Propagate errors from planners to solution comment (`#525 `_) +* Add planner info to comments (`#523 `_) +* Fix MTC unittests for new pipeline refactoring (`#515 `_) +* Update to the more recent JumpThreshold API (`#506 `_) +* JointInterpolationPlanner: Check joint bounds (`#505 `_) +* Add property trajectory_execution_info (`#355 `_, `#502 `_) +* Clear JointStates in scene diff (`#504 `_) +* Set a non-infinite default timeout in CurrentState stage (`#491 `_) +* Add GenerateRandomPose stage (`#166 `_) +* Add planner_id to SubTrajectory info (`#490 `_) +* Remove display_motion_plans and publish_planning_requests properties (`#489 `_) +* Enable parallel planning with PipelinePlanner (`#450 `_) +* GenerateGraspPose: Expose rotation_axis as property (`#535 `_) +* Connect: ensure end-state matches goal state (`#532 `_) +* Fix discontinuity in trajectory (`#485 `_) +* Adaptions for https://github.com/ros-planning/moveit/pull/3534 +* Cleanup debug output +* Fix duplicate solutions +* printPendingPairs(os) -> os<`_ +* DelayingWrapper stage to delay solution shipping in unit tests +* Simplify tests +* Skip Fallbacks::replaceImpl() when already correctly initialized (`#494 `_) +* Fix demos (`#493 `_) +* Limit time to wait for execute_task_solution action server +* Replace namespace robot\_[model|state] with moveit::core +* MPS: fixup processCollisionObject +* Merge PR `#460 `_: improvements to ModifyPlanningScene stage +* Gracefully handle NULL robot_trajectory (`#469 `_) +* introspection: remove any invalid ROS-name chars from hostname (`#465 `_) +* Fix SolutionBase::fillMessage(): also write start_scene +* Fix add/remove object in backward operation +* Add python binding for ModifyPlanningScene::removeObject +* ComputeIK: update RobotState before calling setFromIK() +* Use pluginlib consistently (`#463 `_) +* Expose argument of PipelinePlanner's constructor to Python (`#462 `_) +* Fix allowCollisions(object, enable_collision) +* TestModifyPlanningScene +* Basic Move test: MoveRelative + MoveTo +* Add python binding for ModifyPlanningScene::allowCollisions(std::string, bool) +* Add python binding for Task::insert +* Add Stage::explainFailure() (`#445 `_) +* Improve documentation (`#431 `_) +* JointInterpolationPlanner: pass optional max_effort property along to GripperCommand (`#458 `_) +* Task: findChild() and operator[] should directly operate on stages() (`#435 `_) +* Remove underscore from public members in MotionPlanResponse (`#426 `_) +* ROS 2 Migration (`#170 `_) +* Contributors: Abishalini, Abishalini Sivaraman, Ali Haider, AndyZe, Captain Yoshi, Cihat Kurtuluş Altıparmak, Daniel García López, Gauthier Hentz, Henning Kayser, Jafar, Jafar Uruç, JafarAbdi, Mario Prats, Marq Rasmussen, Michael Görner, Michael Wiznitzer, Paul Gesel, Peter David Fagan, Robert Haschke, Sebastian Castro, Sebastian Jahr, Tyler Weaver, VideoSystemsTech, Wyatt Rees + 0.1.3 (2023-03-06) ------------------ * MoveRelative: Allow backwards operation for joint-space delta (`#436 `_) diff --git a/core/package.xml b/core/package.xml index 6720f64c..3fed9a74 100644 --- a/core/package.xml +++ b/core/package.xml @@ -1,6 +1,6 @@ moveit_task_constructor_core - 0.1.3 + 0.1.4 MoveIt Task Pipeline https://github.com/moveit/moveit_task_constructor diff --git a/demo/CHANGELOG.rst b/demo/CHANGELOG.rst index 56da3339..16f4f698 100644 --- a/demo/CHANGELOG.rst +++ b/demo/CHANGELOG.rst @@ -2,6 +2,39 @@ Changelog for package moveit_task_constructor_demo ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +0.1.4 (2025-10-15) +------------------ +* Fix run.launch.py to load planning pipelines +* Allow max Cartesian link speed in PlannerInterface (`#277 `_) +* Replace deprecated ament_target_dependencies() +* Migrate to new arguments for static_transform_publisher +* Add missing dependency +* CI: Fix Noble builds +* Pick with custom max_velocity_scaling_factor during approach+lift +* Fix pick+place: connect should plan both, arm and hand motion +* Fix duplicate rviz node names (`#672 `_) +* Adapt to new location of generated parameter include files +* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04 +* clang-tidy fixes: std::endl -> '\n' +* Use .hpp headers (`#641 `_) +* examples: add orientation path constraint +* Update API: JumpThreshold -> CartesianPrecision (`#611 `_) +* Fix run.launch.py (`#607 `_) +* Unify Python demo scripts +* Switch shebang to python3 +* Improve comments for pick-and-place task (`#238 `_) +* Expose MultiPlanner to Python (`#474 `_) +* Example of constrained orientation planning +* Switch to package py_binding_tools +* Enable parallel planning with PipelinePlanner (`#450 `_) +* Fix demos (`#493 `_) +* Merge PR `#460 `_: improvements to ModifyPlanningScene stage +* Fix SolutionBase::fillMessage(): also write start_scene +* Replace rosparam_shortcuts with generate_parameter_library (`#403 `_) +* Use moveit_configs_utils for launch files (`#365 `_) +* ROS 2 Migration (`#170 `_) +* Contributors: AndyZe, Cihat Kurtuluş Altıparmak, Fabian Schuetze, Gauthier Hentz, Henning Kayser, Jafar, JafarAbdi, Julia Jia, Karthik Arumugham, Michael Görner, Robert Haschke, Sebastian Jahr, Stephanie Eng, TipluJacob, VideoSystemsTech + 0.1.3 (2023-03-06) ------------------ * Use const reference instead of reference for ros::NodeHandle (`#437 `_) diff --git a/demo/package.xml b/demo/package.xml index 2094835c..f2ccdfda 100644 --- a/demo/package.xml +++ b/demo/package.xml @@ -1,7 +1,7 @@ moveit_task_constructor_demo - 0.1.3 + 0.1.4 demo tasks illustrating various capabilities of MTC. Robert Haschke diff --git a/msgs/CHANGELOG.rst b/msgs/CHANGELOG.rst index 945dd4b9..f6dd621c 100644 --- a/msgs/CHANGELOG.rst +++ b/msgs/CHANGELOG.rst @@ -2,6 +2,14 @@ Changelog for package moveit_task_constructor_msgs ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +0.1.4 (2025-10-15) +------------------ +* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04 +* Add property trajectory_execution_info (`#355 `_, `#502 `_) +* Add planner_id to SubTrajectory info (`#490 `_) +* ROS 2 Migration (`#170 `_) +* Contributors: AndyZe, Henning Kayser, JafarAbdi, Robert Haschke, Sebastian Jahr + 0.1.3 (2023-03-06) ------------------ diff --git a/msgs/package.xml b/msgs/package.xml index 207af1c0..d239b8b5 100644 --- a/msgs/package.xml +++ b/msgs/package.xml @@ -1,6 +1,6 @@ moveit_task_constructor_msgs - 0.1.3 + 0.1.4 Messages for MoveIt Task Pipeline BSD diff --git a/rviz_marker_tools/CHANGELOG.rst b/rviz_marker_tools/CHANGELOG.rst index 584c508a..9a4dc2e4 100644 --- a/rviz_marker_tools/CHANGELOG.rst +++ b/rviz_marker_tools/CHANGELOG.rst @@ -2,6 +2,19 @@ Changelog for package rviz_marker_tools ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +0.1.4 (2025-10-15) +------------------ +* Simplify include of tf2_eigen.hpp +* Replace deprecated ament_target_dependencies() +* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04 +* clang-tidy fixes: use uint8_t enums +* Ignore Debian-specific catkin_lint error around urdfdom_headers (`#614 `_) +* clean up dependencies for rviz_marker_tools (`#610 `_) +* rviz_marker_tools: add missing dependency on urdfdom +* rviz_marker_tools: drop rviz dependency +* ROS 2 Migration (`#170 `_) +* Contributors: AndyZe, Henning Kayser, JafarAbdi, Jochen Sprickerhof, Michael Görner, Robert Haschke + 0.1.3 (2023-03-06) ------------------ diff --git a/rviz_marker_tools/package.xml b/rviz_marker_tools/package.xml index 3805b565..5688fcd0 100644 --- a/rviz_marker_tools/package.xml +++ b/rviz_marker_tools/package.xml @@ -1,6 +1,6 @@ rviz_marker_tools - 0.1.3 + 0.1.4 Tools for marker creation / handling BSD diff --git a/visualization/CHANGELOG.rst b/visualization/CHANGELOG.rst index 5c492add..fc13a0f1 100644 --- a/visualization/CHANGELOG.rst +++ b/visualization/CHANGELOG.rst @@ -2,6 +2,29 @@ Changelog for package moveit_task_constructor_visualization ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^ +0.1.4 (2025-10-15) +------------------ +* Use libyaml_vendor package +* Simplify include of tf2_eigen.hpp +* Mandatory yaml dependency +* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04 +* clang-format-14 +* clang-tidy fixes: use uint8_t enums +* Use .hpp headers (`#641 `_) +* Simplify formatting code with https://github.com/fmtlib (`#499 `_) +* Simplify rclcpp::Node creation +* Fix discontinuity in trajectory (`#485 `_) +* Add planner_id to SubTrajectory info (`#490 `_) +* Cleanup debug output +* Add more debugging output +* Hide button to show rviz-based task construction (`#492 `_) +* Fix Qt 5.15 deprecation warnings +* Limit time to wait for execute_task_solution action server +* Replace namespace robot\_[model|state] with moveit::core +* Use pluginlib consistently (`#463 `_) +* ROS 2 Migration (`#170 `_) +* Contributors: Cihat Kurtuluş Altıparmak, Henning Kayser, JafarAbdi, Michael Görner, Robert Haschke, Sebastian Jahr, Tatsuro Sakaguchi + 0.1.3 (2023-03-06) ------------------ diff --git a/visualization/package.xml b/visualization/package.xml index a1e0fca4..23062857 100644 --- a/visualization/package.xml +++ b/visualization/package.xml @@ -1,6 +1,6 @@ moveit_task_constructor_visualization - 0.1.3 + 0.1.4 Visualization tools for MoveIt Task Pipeline BSD