Skip to content

Commit

Permalink
Sync
Browse files Browse the repository at this point in the history
  • Loading branch information
Timple committed Jul 2, 2024
1 parent a7914b5 commit 4d1ea51
Show file tree
Hide file tree
Showing 3 changed files with 11 additions and 26 deletions.
14 changes: 2 additions & 12 deletions .github/workflows/main.yml
Original file line number Diff line number Diff line change
Expand Up @@ -26,18 +26,8 @@ jobs:
automatic_pose_initializer
autoware_accel_brake_map_calibrator
autoware_ad_api_specs
autoware_adapi_v1_msgs
autoware_adapi_version_msgs
autoware_ar_tag_based_localizer
autoware_auto_common
autoware_auto_control_msgs
autoware_auto_geometry_msgs
autoware_auto_mapping_msgs
autoware_auto_msgs
autoware_auto_perception_msgs
autoware_auto_planning_msgs
autoware_auto_system_msgs
autoware_auto_vehicle_msgs
autoware_autonomous_emergency_braking
autoware_behavior_path_avoidance_by_lane_change_module
autoware_behavior_path_dynamic_obstacle_avoidance_module
Expand Down Expand Up @@ -82,6 +72,7 @@ jobs:
autoware_joy_controller
autoware_landmark_manager
autoware_lane_departure_checker
autoware_lanelet2_extension_python
autoware_localization_msgs
autoware_map_based_prediction
autoware_mission_details_overlay_rviz_plugin
Expand Down Expand Up @@ -170,14 +161,12 @@ jobs:
interpolation
kalman_filter
kinematic_evaluator
lanelet2_extension_python
lanelet2_map_preprocessor
learning_based_vehicle_model
lidar_apollo_instance_segmentation
lidar_apollo_segmentation_tvm
lidar_apollo_segmentation_tvm_nodes
lidar_centerpoint
lidar_centerpoint_tvm
lidar_transfusion
livox_tag_filter
localization_error_monitor
Expand Down Expand Up @@ -290,6 +279,7 @@ jobs:
yabloc_particle_filter
yabloc_pose_initializer
jazzy:
runs-on: ubuntu-22.04
steps:
Expand Down
18 changes: 7 additions & 11 deletions iron.repos
Original file line number Diff line number Diff line change
Expand Up @@ -4,17 +4,17 @@ repositories:
type: git
url: https://github.com/autowarefoundation/autoware.universe.git
version: main
autoware_adapi_msgs:
autoware_cmake:
type: git
url: https://github.com/autowarefoundation/autoware_adapi_msgs
url: https://github.com/autowarefoundation/autoware_cmake.git
version: main
autoware_auto_msgs:
autoware_lanelet2_extension:
type: git
url: https://github.com/tier4/autoware_auto_msgs.git
version: tier4/main
autoware_common:
url: https://github.com/autowarefoundation/autoware_lanelet2_extension.git
version: main
autoware_utils:
type: git
url: https://github.com/autowarefoundation/autoware_common.git
url: https://github.com/autowarefoundation/autoware_utils.git
version: main
autoware_internal_msgs:
type: git
Expand All @@ -37,7 +37,3 @@ repositories:
type: git
url: https://github.com/ros2/rmw_zenoh
version: rolling
tier4_autoware_msgs:
type: git
url: https://github.com/tier4/tier4_autoware_msgs.git
version: tier4/universe
5 changes: 2 additions & 3 deletions jazzy.repos
Original file line number Diff line number Diff line change
Expand Up @@ -19,9 +19,8 @@ repositories:
version: fix/missing-git-dep
off_highway_sensor_drivers:
type: git
# Until: https://github.com/bosch-engineering/off_highway_sensor_drivers/pull/9
url: https://github.com/nobleo/off_highway_sensor_drivers.git
version: fix/missing-dependencies
url: https://github.com/bosch-engineering/off_highway_sensor_drivers.git
version: humble-devel
rmw_zenoh:
type: git
url: https://github.com/ros2/rmw_zenoh
Expand Down

0 comments on commit 4d1ea51

Please sign in to comment.