Skip to content

Conversation

@traversaro
Copy link
Member

@traversaro traversaro commented Jan 16, 2026

I manually aligned files across ros-humble, ros-jazzy and ros-kilted repos (using the three-way directory diff in Meld).

This is just a workaround for RoboStack/robostack.github.io#22, but it was the quickest solution to re-align everything.

I also removed the workaround 01d54f0 as it is not needed after RoboStack/vinca#109 .

@traversaro
Copy link
Member Author

emscripten is failing with error:

Could not generate output for ardrone_sdk
Could not generate output for ardrone_sumo
Could not generate output for as2_behaviors_swarm_flocking
Could not generate output for at_sonde_ros_driver
Could not generate output for autoware_adapi_adaptors
Could not generate output for autoware_adapi_specs
Could not generate output for autoware_behavior_velocity_planner
Could not generate output for autoware_behavior_velocity_planner_common
Could not generate output for autoware_behavior_velocity_stop_line_module
Could not generate output for autoware_component_interface_specs
Could not generate output for autoware_core
Could not generate output for autoware_core_api
Could not generate output for autoware_core_control
Could not generate output for autoware_core_localization
Could not generate output for autoware_core_map
Could not generate output for autoware_core_perception
Could not generate output for autoware_core_planning
Could not generate output for autoware_core_sensing
Could not generate output for autoware_core_vehicle
Could not generate output for autoware_crop_box_filter
Could not generate output for autoware_default_adapi
Could not generate output for autoware_downsample_filters
Could not generate output for autoware_ekf_localizer
Could not generate output for autoware_euclidean_cluster_object_detector
Could not generate output for autoware_geography_utils
Could not generate output for autoware_global_parameter_loader
Could not generate output for autoware_gnss_poser
Could not generate output for autoware_ground_filter
Could not generate output for autoware_gyro_odometer
Could not generate output for autoware_interpolation
Could not generate output for autoware_kalman_filter
Could not generate output for autoware_lanelet2_map_visualizer
Could not generate output for autoware_lanelet2_utils
Could not generate output for autoware_localization_util
                ^^^^^^^^^^^^^^^
  File "/home/runner/work/ros-humble/ros-humble/.pixi/envs/default/lib/python3.11/site-packages/vinca/generate_gha.py", line 436, in get_full_tree
    all_outputs = generate_outputs(distro, temp_vinca_conf)
                  ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
  File "/home/runner/work/ros-humble/ros-humble/.pixi/envs/default/lib/python3.11/site-packages/vinca/main.py", line 602, in generate_outputs
    output = generate_output(
             ^^^^^^^^^^^^^^^^
  File "/home/runner/work/ros-humble/ros-humble/.pixi/envs/default/lib/python3.11/site-packages/vinca/main.py", line 338, in generate_output
    pkg = catkin_pkg.package.parse_package_string(
          ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
  File "/home/runner/work/ros-humble/ros-humble/.pixi/envs/default/lib/python3.11/site-packages/catkin_pkg/package.py", line 610, in parse_package_string
    root = dom.parseString(data)
           ^^^^^^^^^^^^^^^^^^^^^
  File "/home/runner/work/ros-humble/ros-humble/.pixi/envs/default/lib/python3.11/xml/dom/minidom.py", line 2000, in parseString
    return expatbuilder.parseString(string)
           ^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
  File "/home/runner/work/ros-humble/ros-humble/.pixi/envs/default/lib/python3.11/xml/dom/expatbuilder.py", line 925, in parseString
    return builder.parseString(string)
           ^^^^^^^^^^^^^^^^^^^^^^^^^^^
  File "/home/runner/work/ros-humble/ros-humble/.pixi/envs/default/lib/python3.11/xml/dom/expatbuilder.py", line 223, in parseString
    parser.Parse(string, True)
TypeError: a bytes-like object is required, not 'NoneType'
Could not generate output for autoware_map_height_fitter
Could not generate output for autoware_map_loader
Could not generate output for autoware_map_projection_loader
Could not generate output for autoware_marker_utils
Could not generate output for autoware_mission_planner
Could not generate output for autoware_motion_utils
Could not generate output for autoware_motion_velocity_obstacle_stop_module
Could not generate output for autoware_motion_velocity_planner
Could not generate output for autoware_motion_velocity_planner_common
Could not generate output for autoware_ndt_scan_matcher
Could not generate output for autoware_node
Could not generate output for autoware_object_recognition_utils
Could not generate output for autoware_objects_of_interest_marker_interface
Could not generate output for autoware_osqp_interface
Could not generate output for autoware_path_generator
Could not generate output for autoware_perception_objects_converter
Could not generate output for autoware_planning_factor_interface
Could not generate output for autoware_planning_test_manager
Could not generate output for autoware_planning_topic_converter
Could not generate output for autoware_point_types
Could not generate output for autoware_pose_initializer
Could not generate output for autoware_pyplot
Could not generate output for autoware_qp_interface
Could not generate output for autoware_route_handler
Could not generate output for autoware_signal_processing
Could not generate output for autoware_simple_pure_pursuit
Could not generate output for autoware_stop_filter
Could not generate output for autoware_test_node
Could not generate output for autoware_test_utils
Could not generate output for autoware_testing
Could not generate output for autoware_trajectory
Could not generate output for autoware_twist2accel
Could not generate output for autoware_vehicle_info_utils
Could not generate output for autoware_vehicle_velocity_converter
Could not generate output for autoware_velocity_smoother
Could not generate output for bcr_arm
Could not generate output for bcr_arm_description
Could not generate output for bcr_arm_gazebo
Could not generate output for bcr_arm_moveit_config
Could not generate output for bcr_arm_ros2
Could not generate output for cloudini_lib
Could not generate output for cloudini_ros
Could not generate output for etsi_its_conversion_srvs
Could not generate output for event_camera_tools
Could not generate output for ewellix_description
Could not generate output for ewellix_interfaces
Could not generate output for ewellix_lift_common
Could not generate output for ewellix_moveit_config
Could not generate output for ewellix_sim
Could not generate output for ewellix_viz
Could not generate output for fibar_lib
Could not generate output for frequency_cam
Could not generate output for hitch_estimation_apriltag_array
Could not generate output for husarion_components_description
Could not generate output for husarion_ugv_description
Could not generate output for husarion_ugv_msgs
Could not generate output for ign_rviz

@traversaro
Copy link
Member Author

Probably we need to update the vinca version in pixi.toml.

@traversaro
Copy link
Member Author

Probably we need to update the vinca version in pixi.toml.

After updating to the latest vinca, the logic in

if [[ -f "linux.yml" ]]; then
still would not work as the gha files was renamed from linux.yml to linux64.yml in RoboStack/vinca@5f9a3cc . @Tobias-Fischer is the change in file name in vinca intentional?

@Tobias-Fischer
Copy link
Contributor

Hmmm probably not .. happy to revert RoboStack/vinca@5f9a3cc

@traversaro
Copy link
Member Author

Hmmm probably not .. happy to revert RoboStack/vinca@5f9a3cc

Great, see RoboStack/vinca#109 . I think after that PR is merged I can update vinca again in this PR (and revert also 01d54f0).

@traversaro
Copy link
Member Author

@Tobias-Fischer ready for review. Updating to RoboStack/vinca#110 would be a nice to have, but it is not blocking.

@traversaro
Copy link
Member Author

While I was at it, I also cleanup up the latest occurences of REQUIRES_OPENGL, fixing RoboStack/vinca#105 for humble.

@Tobias-Fischer
Copy link
Contributor

Let’s incorporate RoboStack/vinca#110

Sign up for free to join this conversation on GitHub. Already have an account? Sign in to comment

Labels

None yet

Projects

None yet

Development

Successfully merging this pull request may close these issues.

3 participants