Skip to content

Commit 3cdf7f6

Browse files
committed
0.1.4
2 parents 43cd03d + ef1cdee commit 3cdf7f6

File tree

12 files changed

+225
-6
lines changed

12 files changed

+225
-6
lines changed

capabilities/CHANGELOG.rst

Lines changed: 27 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,33 @@
22
Changelog for package moveit_task_constructor_capabilities
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
0.1.4 (2025-10-15)
6+
------------------
7+
* Replace deprecated ament_target_dependencies()
8+
* Migrate to new arguments for static_transform_publisher
9+
* Add missing include fmt/ranges.h (`#712 <https://github.com/moveit/moveit_task_constructor/issues/712>`_)
10+
* Reset preempt_request after canceling execution (`#689 <https://github.com/moveit/moveit_task_constructor/issues/689>`_)
11+
* Let Task::preempt() cancel execute() (`#684 <https://github.com/moveit/moveit_task_constructor/issues/684>`_)
12+
* Add missing include fmt/ranges.h (`#712 <https://github.com/moveit/moveit_task_constructor/issues/712>`_)
13+
* Provide action feedback during task execution (`#653 <https://github.com/moveit/moveit_task_constructor/issues/653>`_)
14+
* Use .hpp headers (`#641 <https://github.com/moveit/moveit_task_constructor/issues/641>`_)
15+
* Silent error "Found empty JointState message"
16+
* Simplify formatting code with https://github.com/fmtlib (`#499 <https://github.com/moveit/moveit_task_constructor/issues/499>`_)
17+
* Print warning if no controllers are configured for trajectory execution (`#514 <https://github.com/moveit/moveit_task_constructor/issues/514>`_)
18+
* Fix Solution::fillMessage() (`#432 <https://github.com/moveit/moveit_task_constructor/issues/432>`_)
19+
* Add property trajectory_execution_info (`#355 <https://github.com/moveit/moveit_task_constructor/issues/355>`_, `#502 <https://github.com/moveit/moveit_task_constructor/issues/502>`_)
20+
* ExecuteTaskSolutionCapability: Reject new goals when busy (`#496 <https://github.com/moveit/moveit_task_constructor/issues/496>`_)
21+
* ExecuteTaskSolutionCapability: Rename goalCallback() -> execCallback()
22+
* Replace namespace robot\_[model|state] with moveit::core
23+
* Use pluginlib consistently (`#463 <https://github.com/moveit/moveit_task_constructor/issues/463>`_)
24+
* remove underscore from public members in MotionPlanResponse (`#426 <https://github.com/moveit/moveit_task_constructor/issues/426>`_)
25+
* Rely on CXXFLAGS definition from moveit_common package
26+
* Fix compiler warnings
27+
* Alphabetize package.xml's and CMakeLists
28+
* execute_task_solution_capability: check for canceling request before canceling the goal handle (`#321 <https://github.com/moveit/moveit_task_constructor/issues/321>`_)
29+
* ROS 2 Migration (`#170 <https://github.com/moveit/moveit_task_constructor/issues/170>`_)
30+
* 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
31+
532
0.1.3 (2023-03-06)
633
------------------
734

capabilities/package.xml

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,6 +1,6 @@
11
<package format="2">
22
<name>moveit_task_constructor_capabilities</name>
3-
<version>0.1.3</version>
3+
<version>0.1.4</version>
44
<description>
55
MoveGroupCapabilites to interact with MoveIt
66
</description>

core/CHANGELOG.rst

Lines changed: 115 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,121 @@
22
Changelog for package moveit_task_constructor_core
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
0.1.4 (2025-10-15)
6+
------------------
7+
* Simplify include of tf2_eigen.hpp
8+
* Avoid duplicate scenes in Solution.msg from generator stages (`#639 <https://github.com/moveit/moveit_task_constructor/issues/639>`_)
9+
* Allow max Cartesian link speed in PlannerInterface (`#277 <https://github.com/moveit/moveit_task_constructor/issues/277>`_)
10+
* Replace deprecated ament_target_dependencies()
11+
* Enable collisions visualizations (`#708 <https://github.com/moveit/moveit_task_constructor/issues/708>`_)
12+
* LimitSolutions wrapper stage (`#710 <https://github.com/moveit/moveit_task_constructor/issues/710>`_)
13+
* Improve code documentation
14+
* CI: Fix Noble builds
15+
* Pick with custom max_velocity_scaling_factor during approach+lift
16+
* Modernize declaration of compile options
17+
* Factor out Python property handling to allow for reuse in custom Python wrappers
18+
* Let Task::preempt() cancel execute() (`#684 <https://github.com/moveit/moveit_task_constructor/issues/684>`_)
19+
* Fix clamping of joint constraints (`#665 <https://github.com/moveit/moveit_task_constructor/issues/665>`_)
20+
* Correctly report failures instead of issueing console warnings
21+
* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04
22+
* Python API: Allow passing a task's introspection object to SolutionBase::toMsg()
23+
* clang-format-14
24+
* Use .hpp headers (`#641 <https://github.com/moveit/moveit_task_constructor/issues/641>`_)
25+
* Add support for GenerateRandomPose
26+
* python: Add Task::setRobotModel
27+
* Add path_constraints property to Connect stage
28+
* provide a fmt wrapper (`#615 <https://github.com/moveit/moveit_task_constructor/issues/615>`_)
29+
* Update API: JumpThreshold -> CartesianPrecision (`#611 <https://github.com/moveit/moveit_task_constructor/issues/611>`_)
30+
* Reduce stop time due to preempt (`#598 <https://github.com/moveit/moveit_task_constructor/issues/598>`_)
31+
* Add unittest for `#581 <https://github.com/moveit/moveit_task_constructor/issues/581>`_
32+
* Fix early planning preemption (`#597 <https://github.com/moveit/moveit_task_constructor/issues/597>`_)
33+
* MoveRelative: fix segfault on empty trajectory (`#595 <https://github.com/moveit/moveit_task_constructor/issues/595>`_)
34+
* MoveRelative: handle equal min/max distance (`#593 <https://github.com/moveit/moveit_task_constructor/issues/593>`_)
35+
* CI: skip python tests
36+
* Adapt python scripts to ROS2 API changes
37+
* Reenable python bindings
38+
* Cleanup unit tests and allow them to run via both, cmdline and pytest
39+
* Connect: Relax validity check of reached end state
40+
* Unify Python demo scripts
41+
* Switch shebang to python3
42+
* Silence gcc's overloaded-virtual warnings
43+
* Fix flaky IK in asan unit test: increase timeout
44+
* Fix failing unittests: remove static executor
45+
* Add property to enable/disable pruning at runtime (`#590 <https://github.com/moveit/moveit_task_constructor/issues/590>`_)
46+
* Disable pruning by default
47+
* test_pruning.cpp: Add new test
48+
* test_pruning.cpp: Extend test to ParallelContainer
49+
* PassThrough: cleanup unused headers
50+
* Avoid segfault if TimeParameterization is not set
51+
* CartesianPath: allow ik_frame definition if start and end are given as joint-space poses
52+
* Generalize utils::getRobotTipForFrame() to return error_msg instead of calling markAsFailure() on a solution
53+
* ComputeIK: Allow additional constraints for filtering solutions (`#464 <https://github.com/moveit/moveit_task_constructor/issues/464>`_)
54+
* Expose MultiPlanner to Python (`#474 <https://github.com/moveit/moveit_task_constructor/issues/474>`_)
55+
* Add unittest cartesianCollisionMinMaxDistance (`#538 <https://github.com/moveit/moveit_task_constructor/issues/538>`_)
56+
* Connect: Relax validity check of reached end state (`#542 <https://github.com/moveit/moveit_task_constructor/issues/542>`_)
57+
* Simplify formatting code with https://github.com/fmtlib (`#499 <https://github.com/moveit/moveit_task_constructor/issues/499>`_)
58+
* Add NoOp stage (`#534 <https://github.com/moveit/moveit_task_constructor/issues/534>`_)
59+
* ModifyPlanningScene: check state for collisions
60+
* Improve TypeError exceptions
61+
* Switch to package py_binding_tools
62+
* Add ability to move CollisionObjects (`#567 <https://github.com/moveit/moveit_task_constructor/issues/567>`_)
63+
* Simplify rclcpp::Node creation
64+
* Improve description of max_distance property of Connect stage (`#564 <https://github.com/moveit/moveit_task_constructor/issues/564>`_)
65+
* Add Generator::spawn(from, to, trajectory) variant (`#546 <https://github.com/moveit/moveit_task_constructor/issues/546>`_)
66+
* Cosmetic fixes
67+
* Fix Solution::fillMessage() (`#432 <https://github.com/moveit/moveit_task_constructor/issues/432>`_)
68+
* Fix generation of Solution msg: consider backward operation
69+
* Propagate errors from planners to solution comment (`#525 <https://github.com/moveit/moveit_task_constructor/issues/525>`_)
70+
* Add planner info to comments (`#523 <https://github.com/moveit/moveit_task_constructor/issues/523>`_)
71+
* Fix MTC unittests for new pipeline refactoring (`#515 <https://github.com/moveit/moveit_task_constructor/issues/515>`_)
72+
* Update to the more recent JumpThreshold API (`#506 <https://github.com/moveit/moveit_task_constructor/issues/506>`_)
73+
* JointInterpolationPlanner: Check joint bounds (`#505 <https://github.com/moveit/moveit_task_constructor/issues/505>`_)
74+
* Add property trajectory_execution_info (`#355 <https://github.com/moveit/moveit_task_constructor/issues/355>`_, `#502 <https://github.com/moveit/moveit_task_constructor/issues/502>`_)
75+
* Clear JointStates in scene diff (`#504 <https://github.com/moveit/moveit_task_constructor/issues/504>`_)
76+
* Set a non-infinite default timeout in CurrentState stage (`#491 <https://github.com/moveit/moveit_task_constructor/issues/491>`_)
77+
* Add GenerateRandomPose stage (`#166 <https://github.com/moveit/moveit_task_constructor/issues/166>`_)
78+
* Add planner_id to SubTrajectory info (`#490 <https://github.com/moveit/moveit_task_constructor/issues/490>`_)
79+
* Remove display_motion_plans and publish_planning_requests properties (`#489 <https://github.com/moveit/moveit_task_constructor/issues/489>`_)
80+
* Enable parallel planning with PipelinePlanner (`#450 <https://github.com/moveit/moveit_task_constructor/issues/450>`_)
81+
* GenerateGraspPose: Expose rotation_axis as property (`#535 <https://github.com/moveit/moveit_task_constructor/issues/535>`_)
82+
* Connect: ensure end-state matches goal state (`#532 <https://github.com/moveit/moveit_task_constructor/issues/532>`_)
83+
* Fix discontinuity in trajectory (`#485 <https://github.com/moveit/moveit_task_constructor/issues/485>`_)
84+
* Adaptions for https://github.com/ros-planning/moveit/pull/3534
85+
* Cleanup debug output
86+
* Fix duplicate solutions
87+
* printPendingPairs(os) -> os<<pendingPairsPrinter()
88+
* Fix leaking of failures into enumerated solutions
89+
* Add more debugging output
90+
* Unit tests for `#485 <https://github.com/moveit/moveit_task_constructor/issues/485>`_
91+
* DelayingWrapper stage to delay solution shipping in unit tests
92+
* Simplify tests
93+
* Skip Fallbacks::replaceImpl() when already correctly initialized (`#494 <https://github.com/moveit/moveit_task_constructor/issues/494>`_)
94+
* Fix demos (`#493 <https://github.com/moveit/moveit_task_constructor/issues/493>`_)
95+
* Limit time to wait for execute_task_solution action server
96+
* Replace namespace robot\_[model|state] with moveit::core
97+
* MPS: fixup processCollisionObject
98+
* Merge PR `#460 <https://github.com/moveit/moveit_task_constructor/issues/460>`_: improvements to ModifyPlanningScene stage
99+
* Gracefully handle NULL robot_trajectory (`#469 <https://github.com/moveit/moveit_task_constructor/issues/469>`_)
100+
* introspection: remove any invalid ROS-name chars from hostname (`#465 <https://github.com/moveit/moveit_task_constructor/issues/465>`_)
101+
* Fix SolutionBase::fillMessage(): also write start_scene
102+
* Fix add/remove object in backward operation
103+
* Add python binding for ModifyPlanningScene::removeObject
104+
* ComputeIK: update RobotState before calling setFromIK()
105+
* Use pluginlib consistently (`#463 <https://github.com/moveit/moveit_task_constructor/issues/463>`_)
106+
* Expose argument of PipelinePlanner's constructor to Python (`#462 <https://github.com/moveit/moveit_task_constructor/issues/462>`_)
107+
* Fix allowCollisions(object, enable_collision)
108+
* TestModifyPlanningScene
109+
* Basic Move test: MoveRelative + MoveTo
110+
* Add python binding for ModifyPlanningScene::allowCollisions(std::string, bool)
111+
* Add python binding for Task::insert
112+
* Add Stage::explainFailure() (`#445 <https://github.com/moveit/moveit_task_constructor/issues/445>`_)
113+
* Improve documentation (`#431 <https://github.com/moveit/moveit_task_constructor/issues/431>`_)
114+
* JointInterpolationPlanner: pass optional max_effort property along to GripperCommand (`#458 <https://github.com/moveit/moveit_task_constructor/issues/458>`_)
115+
* Task: findChild() and operator[] should directly operate on stages() (`#435 <https://github.com/moveit/moveit_task_constructor/issues/435>`_)
116+
* Remove underscore from public members in MotionPlanResponse (`#426 <https://github.com/moveit/moveit_task_constructor/issues/426>`_)
117+
* ROS 2 Migration (`#170 <https://github.com/moveit/moveit_task_constructor/issues/170>`_)
118+
* 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
119+
5120
0.1.3 (2023-03-06)
6121
------------------
7122
* MoveRelative: Allow backwards operation for joint-space delta (`#436 <https://github.com/ros-planning/moveit_task_constructor/issues/436>`_)

core/package.xml

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,6 +1,6 @@
11
<package format="3">
22
<name>moveit_task_constructor_core</name>
3-
<version>0.1.3</version>
3+
<version>0.1.4</version>
44
<description>MoveIt Task Pipeline</description>
55

66
<url type="website">https://github.com/moveit/moveit_task_constructor</url>

demo/CHANGELOG.rst

Lines changed: 33 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,39 @@
22
Changelog for package moveit_task_constructor_demo
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
0.1.4 (2025-10-15)
6+
------------------
7+
* Fix run.launch.py to load planning pipelines
8+
* Allow max Cartesian link speed in PlannerInterface (`#277 <https://github.com/moveit/moveit_task_constructor/issues/277>`_)
9+
* Replace deprecated ament_target_dependencies()
10+
* Migrate to new arguments for static_transform_publisher
11+
* Add missing dependency
12+
* CI: Fix Noble builds
13+
* Pick with custom max_velocity_scaling_factor during approach+lift
14+
* Fix pick+place: connect should plan both, arm and hand motion
15+
* Fix duplicate rviz node names (`#672 <https://github.com/moveit/moveit_task_constructor/issues/672>`_)
16+
* Adapt to new location of generated parameter include files
17+
* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04
18+
* clang-tidy fixes: std::endl -> '\n'
19+
* Use .hpp headers (`#641 <https://github.com/moveit/moveit_task_constructor/issues/641>`_)
20+
* examples: add orientation path constraint
21+
* Update API: JumpThreshold -> CartesianPrecision (`#611 <https://github.com/moveit/moveit_task_constructor/issues/611>`_)
22+
* Fix run.launch.py (`#607 <https://github.com/moveit/moveit_task_constructor/issues/607>`_)
23+
* Unify Python demo scripts
24+
* Switch shebang to python3
25+
* Improve comments for pick-and-place task (`#238 <https://github.com/moveit/moveit_task_constructor/issues/238>`_)
26+
* Expose MultiPlanner to Python (`#474 <https://github.com/moveit/moveit_task_constructor/issues/474>`_)
27+
* Example of constrained orientation planning
28+
* Switch to package py_binding_tools
29+
* Enable parallel planning with PipelinePlanner (`#450 <https://github.com/moveit/moveit_task_constructor/issues/450>`_)
30+
* Fix demos (`#493 <https://github.com/moveit/moveit_task_constructor/issues/493>`_)
31+
* Merge PR `#460 <https://github.com/moveit/moveit_task_constructor/issues/460>`_: improvements to ModifyPlanningScene stage
32+
* Fix SolutionBase::fillMessage(): also write start_scene
33+
* Replace rosparam_shortcuts with generate_parameter_library (`#403 <https://github.com/moveit/moveit_task_constructor/issues/403>`_)
34+
* Use moveit_configs_utils for launch files (`#365 <https://github.com/moveit/moveit_task_constructor/issues/365>`_)
35+
* ROS 2 Migration (`#170 <https://github.com/moveit/moveit_task_constructor/issues/170>`_)
36+
* 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
37+
538
0.1.3 (2023-03-06)
639
------------------
740
* Use const reference instead of reference for ros::NodeHandle (`#437 <https://github.com/ros-planning/moveit_task_constructor/issues/437>`_)

demo/package.xml

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,7 +1,7 @@
11
<?xml version="1.0"?>
22
<package format="2">
33
<name>moveit_task_constructor_demo</name>
4-
<version>0.1.3</version>
4+
<version>0.1.4</version>
55
<description>demo tasks illustrating various capabilities of MTC.</description>
66

77
<author email="[email protected]">Robert Haschke</author>

msgs/CHANGELOG.rst

Lines changed: 8 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,14 @@
22
Changelog for package moveit_task_constructor_msgs
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
0.1.4 (2025-10-15)
6+
------------------
7+
* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04
8+
* Add property trajectory_execution_info (`#355 <https://github.com/moveit/moveit_task_constructor/issues/355>`_, `#502 <https://github.com/moveit/moveit_task_constructor/issues/502>`_)
9+
* Add planner_id to SubTrajectory info (`#490 <https://github.com/moveit/moveit_task_constructor/issues/490>`_)
10+
* ROS 2 Migration (`#170 <https://github.com/moveit/moveit_task_constructor/issues/170>`_)
11+
* Contributors: AndyZe, Henning Kayser, JafarAbdi, Robert Haschke, Sebastian Jahr
12+
513
0.1.3 (2023-03-06)
614
------------------
715

msgs/package.xml

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,6 +1,6 @@
11
<package format="3">
22
<name>moveit_task_constructor_msgs</name>
3-
<version>0.1.3</version>
3+
<version>0.1.4</version>
44
<description>Messages for MoveIt Task Pipeline</description>
55

66
<license>BSD</license>

rviz_marker_tools/CHANGELOG.rst

Lines changed: 13 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -2,6 +2,19 @@
22
Changelog for package rviz_marker_tools
33
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
44

5+
0.1.4 (2025-10-15)
6+
------------------
7+
* Simplify include of tf2_eigen.hpp
8+
* Replace deprecated ament_target_dependencies()
9+
* Increase minimum required CMake version to 3.16 supported by Ubuntu 20.04
10+
* clang-tidy fixes: use uint8_t enums
11+
* Ignore Debian-specific catkin_lint error around urdfdom_headers (`#614 <https://github.com/moveit/moveit_task_constructor/issues/614>`_)
12+
* clean up dependencies for rviz_marker_tools (`#610 <https://github.com/moveit/moveit_task_constructor/issues/610>`_)
13+
* rviz_marker_tools: add missing dependency on urdfdom
14+
* rviz_marker_tools: drop rviz dependency
15+
* ROS 2 Migration (`#170 <https://github.com/moveit/moveit_task_constructor/issues/170>`_)
16+
* Contributors: AndyZe, Henning Kayser, JafarAbdi, Jochen Sprickerhof, Michael Görner, Robert Haschke
17+
518
0.1.3 (2023-03-06)
619
------------------
720

rviz_marker_tools/package.xml

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,6 +1,6 @@
11
<package format="2">
22
<name>rviz_marker_tools</name>
3-
<version>0.1.3</version>
3+
<version>0.1.4</version>
44
<description>Tools for marker creation / handling</description>
55

66
<license>BSD</license>

0 commit comments

Comments
 (0)