moveit / moveit2

:robot: MoveIt for ROS 2
https://moveit.ai/
BSD 3-Clause "New" or "Revised" License
1.05k stars 513 forks source link

`moveit_kinematics` regression on ROS 2 Buildfarm for Iron #2758

Closed Yadunund closed 3 months ago

Yadunund commented 6 months ago

The next Iron sync is blocked by regressions in moveit_kinematics which affects several downstream packages.

See https://build.ros2.org/view/Ibin_uJ64/job/Ibin_uJ64__moveit_kinematics__ubuntu_jammy_amd64__binary/

In file included from /tmp/binarydeb/ros-iron-moveit-kinematics-2.8.0/kdl_kinematics_plugin/include/moveit/kdl_kinematics_plugin/kdl_kinematics_plugin.h:42,
                 from /tmp/binarydeb/ros-iron-moveit-kinematics-2.8.0/kdl_kinematics_plugin/src/kdl_kinematics_plugin.cpp:37:
/tmp/binarydeb/ros-iron-moveit-kinematics-2.8.0/.obj-x86_64-linux-gnu/kdl_kinematics_plugin/kdl_kinematics_parameters/include/kdl_kinematics_parameters.hpp: In member function ‘void kdl_kinematics::ParamListener::refresh_dynamic_parameters()’:
/tmp/binarydeb/ros-iron-moveit-kinematics-2.8.0/.obj-x86_64-linux-gnu/kdl_kinematics_plugin/kdl_kinematics_parameters/include/kdl_kinematics_parameters.hpp:146:36: error: expected unqualified-id before ‘.’ token
  146 |       auto& entry = updated_params..joints_map[value_1];
      |                                    ^
/tmp/binarydeb/ros-iron-moveit-kinematics-2.8.0/.obj-x86_64-linux-gnu/kdl_kinematics_plugin/kdl_kinematics_parameters/include/kdl_kinematics_parameters.hpp: In member function ‘rcl_interfaces::msg::SetParametersResult kdl_kinematics::ParamListener::update(const std::vector<rclcpp::Parameter>&)’:
/tmp/binarydeb/ros-iron-moveit-kinematics-2.8.0/.obj-x86_64-linux-gnu/kdl_kinematics_plugin/kdl_kinematics_parameters/include/kdl_kinematics_parameters.hpp:217:32: error: expected unqualified-id before ‘.’ token
  217 |                 updated_params..joints_map[value_1].weight = param.as_double();
      |                                ^
/tmp/binarydeb/ros-iron-moveit-kinematics-2.8.0/.obj-x86_64-linux-gnu/kdl_kinematics_plugin/kdl_kinematics_parameters/include/kdl_kinematics_parameters.hpp: In member function ‘void kdl_kinematics::ParamListener::declare_params()’:
/tmp/binarydeb/ros-iron-moveit-kinematics-2.8.0/.obj-x86_64-linux-gnu/kdl_kinematics_plugin/kdl_kinematics_parameters/include/kdl_kinematics_parameters.hpp:308:36: error: expected unqualified-id before ‘.’ token
  308 |       auto& entry = updated_params..joints_map[value_1];
      |                                    ^

Related ticket: https://github.com/ros-planning/moveit2/issues/2749

clalancette commented 6 months ago

This is also affecting Rolling: https://build.ros2.org/view/Rbin_uN64/job/Rbin_uN64__moveit_kinematics__ubuntu_noble_amd64__binary/6/console

sea-bass commented 6 months ago

Hi guys,

We did not find the time to fix this bug in a timely fashion, so I think we should revert this on Humble/Iron/Rolling and we'll bloom a fixed up version of this release whenever we are ready.

Thanks for flagging this! We've had it breaking MoveIt's CI as well.

Yadunund commented 6 months ago

@sea-bass thanks a lot for the proactive update, really appreciate it. I'll go ahead and revert bump to generate_parameter_library https://github.com/ros/rosdistro/pull/40305

MatthijsBurgh commented 6 months ago

This explains the missing rolling release on Noble (No .deb for Noble) image

moveit_msgs does have release: image

github-actions[bot] commented 5 months ago

This issue is being labeled as stale because it has been open 45 days with no activity. It will be automatically closed after another 45 days without follow-ups.

github-actions[bot] commented 3 months ago

This issue was closed because it has been stalled for 45 days with no activity.