ros / rosdistro

This repo maintains a lists of repositories for each ROS distribution
Other
913 stars 2.54k forks source link

aerostack2: 1.1.1-1 in 'humble/distribution.yaml' [bloom] #42502

Closed pariaspe closed 3 weeks ago

pariaspe commented 3 weeks ago

Increasing version of package(s) in repository aerostack2 to 1.1.1-1:

aerostack2

* [as2_keyboard_teleoperation] context is modified manually from generated config file
* [as2_msgs] add sensor msgs dependency
* [as2_python_api] License fix using ament copyright
* [as2_state_estimator] Fix gtest warning: publisher already registered
* [as2_usb_camera_interface] Fix gtest warning: publisher already registered
* Contributors: Rafael Perez-Segui, pariaspe, Miguel Fernandez-Cortizas, Javilinos

as2_alphanumeric_viewer

as2_behavior

as2_behavior_tree

as2_behaviors_motion

as2_behaviors_path_planning

as2_behaviors_perception

as2_behaviors_platform

as2_behaviors_trajectory_generation

as2_cli

as2_core

as2_external_object_to_tf

as2_gazebo_assets

as2_geozones

as2_keyboard_teleoperation

* [as2_keyboard_teleoperation] context is modified manually from generated config file
* Contributors: Javilinos, pariaspe

as2_map_server

as2_motion_controller

as2_motion_reference_handlers

as2_msgs

* [as2_msgs] add sensor msgs dependency
* Contributors: Miguel Fernandez-Cortizas

as2_platform_gazebo

as2_platform_multirotor_simulator

as2_python_api

* [as2_python_api] License fix using ament copyright
* Contributors: Rafael Perez-Segui, pariaspe

as2_realsense_interface

as2_rviz_plugins

as2_state_estimator

* [as2_state_estimator] Fix gtest warning: publisher already registered
* Contributors: Rafael Perez-Segui, pariaspe

as2_usb_camera_interface

* [as2_usb_camera_interface] Fix gtest warning: publisher already registered
* Contributors: Rafael Perez-Segui, pariaspe

as2_visualization

pariaspe commented 3 weeks ago

New version should fix previous fails on buildfarm: https://github.com/ros/rosdistro/pull/42496

audrow commented 3 weeks ago

@pariaspe, it seems there are still a few new buildfarm failures. I'm going to revert this one, too. We're probably closer to it working.

audrow commented 3 weeks ago

It looks like CI on the revert fails, maybe because packages were moved. Would you fix the dependency error and make another release? I'm hoping to announce a Humble sync today.

01:26:44 CMake Error at CMakeLists.txt:37 (find_package):
01:26:44   By not providing "Findbackward_ros.cmake" in CMAKE_MODULE_PATH this project
01:26:44   has asked CMake to find a package configuration file provided by
01:26:44   "backward_ros", but CMake did not find one.
01:26:44 
01:26:44   Could not find a package configuration file provided by "backward_ros" with
01:26:44   any of the following names:
01:26:44 
01:26:44     backward_rosConfig.cmake
01:26:44     backward_ros-config.cmake
01:26:44 
01:26:44   Add the installation prefix of "backward_ros" to CMAKE_PREFIX_PATH or set
01:26:44   "backward_ros_DIR" to a directory containing one of the above files.  If
01:26:44   "backward_ros" provides a separate development package or SDK, be sure it
01:26:44   has been installed.