Skip to content
This repository was archived by the owner on Oct 23, 2025. It is now read-only.

Commit b308cfd

Browse files
authored
Update ros_ign to ros_gz in Rolling (#401)
* Update ros_ign to ros_gz in Rolling * Add in Jazzy as well. Signed-off-by: Addisu Z. Taddese <[email protected]> Signed-off-by: Chris Lalancette <[email protected]>
1 parent 32b82ba commit b308cfd

File tree

1 file changed

+107
-2
lines changed

1 file changed

+107
-2
lines changed

rep-2001.rst

Lines changed: 107 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -775,6 +775,111 @@ Desktop Full
775775
packages: [perception, simulation, ros_ign_gazebo_demos]
776776

777777

778+
Jazzy Jalisco (May 2024 - May 2029)
779+
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
780+
781+
ROS Core
782+
""""""""
783+
784+
::
785+
786+
- ros_core:
787+
packages: [ament_cmake, ament_cmake_auto, ament_cmake_gmock,
788+
ament_cmake_gtest, ament_cmake_pytest,
789+
ament_cmake_ros, ament_index_cpp,
790+
ament_index_python, ament_lint_auto,
791+
ament_lint_common, class_loader, common_interfaces,
792+
launch, launch_ros, launch_testing,
793+
launch_testing_ament_cmake, launch_testing_ros,
794+
launch_xml, launch_yaml, pluginlib, rcl_lifecycle,
795+
rclcpp, rclcpp_action, rclcpp_lifecycle, rclpy,
796+
ros2cli_common_extensions, ros2launch,
797+
ros_environment, rosidl_default_generators,
798+
rosidl_default_runtime, sros2, sros2_cmake]
799+
And at least one of the following rmw_implementation:
800+
- Fast-RTPS: [Fast-CDR, Fast-RTPS, rmw_fastrtps]
801+
- CycloneDDS: [cyclonedds, rmw_cyclonedds]
802+
- Connext: [rmw_connextdds]
803+
804+
805+
ROS Base
806+
""""""""
807+
808+
::
809+
810+
- ros_base:
811+
extends: [ros_core]
812+
packages: [geometry2, kdl_parser, robot_state_publisher,
813+
rosbag2, urdf]
814+
815+
816+
Desktop
817+
"""""""
818+
819+
::
820+
821+
- desktop:
822+
extends: [ros_base]
823+
packages: [action_tutorials_cpp, action_tutorials_interfaces,
824+
action_tutorials_py, angles, composition,
825+
demo_nodes_cpp, demo_nodes_cpp_native,
826+
demo_nodes_py, depthimage_to_laserscan,
827+
dummy_map_server, dummy_robot_bringup,
828+
dummy_sensors,
829+
examples_rclcpp_minimal_action_client,
830+
examples_rclcpp_minimal_action_server,
831+
examples_rclcpp_minimal_client,
832+
examples_rclcpp_minimal_composition,
833+
examples_rclcpp_minimal_publisher,
834+
examples_rclcpp_minimal_service,
835+
examples_rclcpp_minimal_subscriber,
836+
examples_rclcpp_minimal_timer,
837+
examples_rclcpp_multithreaded_executor,
838+
examples_rclpy_executors,
839+
examples_rclpy_minimal_action_client,
840+
examples_rclpy_minimal_action_server,
841+
examples_rclpy_minimal_client,
842+
examples_rclpy_minimal_publisher,
843+
examples_rclpy_minimal_service,
844+
examples_rclpy_minimal_subscriber, image_tools,
845+
intra_process_demo, joy, lifecycle, logging_demo,
846+
pcl_conversions, pendulum_control, pendulum_msgs,
847+
quality_of_service_demo_cpp,
848+
quality_of_service_demo_py, rqt_common_plugins,
849+
rviz2, rviz_default_plugins, teleop_twist_joy,
850+
teleop_twist_keyboard, tlsf, tlsf_cpp,
851+
topic_monitor, turtlesim]
852+
853+
Perception
854+
""""""""""
855+
856+
::
857+
858+
- perception:
859+
extends: [ros_base]
860+
packages: [image_common, image_pipeline, image_transport_plugins,
861+
laser_filters, laser_geometry, perception_pcl,
862+
vision_opencv]
863+
864+
Simulation
865+
""""""""""
866+
867+
::
868+
869+
- simulation:
870+
extends: [ros_base]
871+
packages: [ros_gz_bridge, ros_gz_sim, ros_gz_image, ros_gz_interfaces]
872+
873+
Desktop Full
874+
""""""""""""
875+
876+
::
877+
878+
- desktop_full:
879+
extends: [desktop]
880+
packages: [perception, simulation, ros_gz_sim_demos]
881+
882+
778883
Rolling Ridley (June 2020 - Ongoing)
779884
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
780885

@@ -868,7 +973,7 @@ Simulation
868973

869974
- simulation:
870975
extends: [ros_base]
871-
packages: [ros_ign_bridge, ros_ign_gazebo, ros_ign_image, ros_ign_interfaces]
976+
packages: [ros_gz_bridge, ros_gz_sim, ros_gz_image, ros_gz_interfaces]
872977

873978
Desktop Full
874979
""""""""""""
@@ -877,7 +982,7 @@ Desktop Full
877982

878983
- desktop_full:
879984
extends: [desktop]
880-
packages: [perception, simulation, ros_ign_gazebo_demos]
985+
packages: [perception, simulation, ros_gz_sim_demos]
881986

882987

883988
ROS Distribution Independent (September 2022 - Ongoing)

0 commit comments

Comments
 (0)