Planet ROS
Planet ROS - http://planet.ros.org
Planet ROS - http://planet.ros.org http://planet.ros.org
ROS Discourse General: ROS News for the Week of February 17th, 2025
ROS News for the Week of February 17th, 2025
TurtleBot3 66 Multi-Robot Control with TurtleBot3
Events
-
2025-02-26 Bridging ROS 2 with Simulink for Model-Based Design
-
2025-04-28 International Workshop on Robotics Software Engineering
-
2025-05-15 ROS-Industrial Consortium Americas 2025 Annual Meeting Detroit
-
2025-05-23 ICRA 2025 Advancing Quantitative and QUAlitative SIMulators for marine applications
-
2025-05-30 => 2025-05-31 2025 Open Hardware Summit in Edinburgh
News
OSRA News
-
Calendar: February 2025 TGC meeting scheduled on 27 Thu @ 15:00 UTC. Jan 2025 meeting minutes to be published after approval.
-
OSRA Gold Member Stogl Robotics expands reach in Europe and is now b>>robotized by Stogl Robotics
-
OSRA Platinum Member NVIDIA is hosting GTC March 17th to 21st. If you’re going, there will be a Physical AI Developer Meetup on Wednesday, March 19, 2025 - 7:30 p.m. - 9:30 p.m. PDT RSVP here, and the NVIDIA team recommends these agenda items for ROS users. There’s also likely to be a ROS users meetup there.
ROS
Got a Minute data:image/s3,"s3://crabby-images/f163d/f163de6b4e50eee44073e7a96028c3ec0a29dc61" alt=":mantelpiece_clock: :mantelpiece_clock:"
We had one item this week that are looking for feedback.
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: Cloud Robotics WG Meeting 2025-02-24
Please come and join us for this coming meeting at 2025-02-24T17:00:00Z UTC→2025-02-24T18:00:00Z UTC, where we will discuss the latest in Cloud Robotics news. The session will be more of an informal chat.
Last meeting, we tried out KubeEdge using cloud Ubuntu instances and Raspberry Pi boards. We were unable to get a full setup working, but we did see some KubeEdge functionality and were able to provide feedback to the writers. If you’re interested to see the meeting, it is available on YouTube.
If you are willing and able to give a talk on cloud robotics in future meetings, we would be happy to host you - please reply here, message me directly, or sign up using the Guest Speaker Signup Sheet. We will record your talk and host it on YouTube with our other meeting recordings too!
The meeting link is here, and you can sign up to our calendar or our Google Group for meeting notifications or keep an eye on the Cloud Robotics Hub.
Hopefully we will see you there!
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: QR Code Vision Tracking: Machine Vision Intergeration Into ROS
In this article, I will share the process of bringing a Python-based robotic arm QR code tracking system into ROS and running this project in a simulation environment.
Youtube:
myCobot 280 | ROS Visual Tracking Case Tutorial
Environment Setup
For this project, it is recommended to use the following development environment and dependency versions:
● Operating System : Ubuntu 20.04 LTS
● ROS Version : Noetic
● Python Version : Python 3.8 or higher
● Library Version Requirement : pymycobot 3.6 or higher
Installing Key Dependencies
Run the following commands in the terminal to install the necessary Python libraries:
pip install stag-python opencv-python scipy numpy pymycobot
Creating a Workspace and Package in ROS
Creating a ROS Workspace
- Open the terminal and create a new ROS workspace called catkin_ws:
mkdir -p ~/catkin_ws/src
- Enter the workspace directory and initialize it:
cd ~/catkin_wscatkin_make
- Set up the environment variables to ensure ROS can locate the workspace:
echo "source ~/catkin_ws/devel/setup.bash" >> ~/.bashrcsource ~/.bashrc
Tip : This configuration will load the workspace settings automatically each time a new terminal is opened.
Creating a ROS Package
- In the src directory, create a new ROS package called qr_tracking with required dependencies (such as rospy and std_msgs):
cd ~/catkin_ws/srccatkin_create_pkg qr_tracking rospy std_msgs
2.Verify the package creation. The qr_tracking directory should contain a standard ROS package structure, including CMakeLists.txt and package.xml files.
- Update dependencies: Open the package.xml file and ensure the following dependencies are included:
<?xml version="1.0"?>
<package format="2">
<name>mycobot_280</name>
<version>0.3.0</version>
<description>The mycobot 280 package</description>
<author email="lijun.zhang@elephantrobotics.com">ZhangLijun</author>
<maintainer email="lijun.zhang@elephantrobotics.com">ZhangLijun</maintainer>
<license>BSD</license>
<url type="website">https://github.com/elephantrobotics/mycobot_ros</url>
<buildtool_depend>catkin</buildtool_depend>
<build_depend>roscpp</build_depend>
<build_depend>rospy</build_depend>
<build_depend>std_msgs</build_depend>
<build_depend>actionlib</build_depend>
<build_depend>mycobot_description</build_depend>
<build_depend>mycobot_communication</build_depend>
<build_export_depend>mycobot_communication</build_export_depend>
<build_export_depend>mycobot_description</build_export_depend>
<exec_depend>roscpp</exec_depend>
<exec_depend>rospy</exec_depend>
<exec_depend>std_msgs</exec_depend>
<exec_depend>actionlib</exec_depend>
<exec_depend>joint_state_publisher</exec_depend>
<exec_depend>joint_state_publisher_gui</exec_depend>
<exec_depend>robot_state_publisher</exec_depend>
<exec_depend>xacro</exec_depend>
<exec_depend>joy</exec_depend>
<exec_depend>rviz</exec_depend>
<exec_depend>controller_manager</exec_depend>
<exec_depend>python-tk</exec_depend>
<exec_depend>mycobot_description</exec_depend>
<exec_depend>mycobot_communication</exec_depend>
<export>
<!-- Additional information for other tools can be added here -->
</export>
</package>
- Rebuild the workspace to apply the ROS package configuration updates:
cd ~/catkin_wscatkin_make
Ensure that the URDF file for the robotic arm is correctly configured within the ROS package to display the model accurately.
Importing Python Files into the ROS Package
Setting Up the Scripts Directory
In your ROS package qr_tracking
, create a folder named scripts
to store the Python scripts. Use the following commands:
cd ~/catkin_ws/src/qr_tracking
mkdir scripts
Move your Python files (such as camera_detect.py
, uvc_camera.py
, marker_utils.py
, etc.) to this scripts
directory:
mv /path/to/camera_detect.py ~/catkin_ws/src/qr_tracking/scripts/
mv /path/to/uvc_camera.py ~/catkin_ws/src/qr_tracking/scripts/
mv /path/to/marker_utils.py ~/catkin_ws/src/qr_tracking/scripts/
Modifying Python Files for ROS Compatibility
To ensure the Python scripts work with ROS, you need to make some adjustments, such as importing ROS libraries, initializing ROS nodes, and defining message publishers/subscribers. Using camera_detect.py
as an example, here are the primary modifications needed:
- Import ROS Libraries
At the top of your Python file, add imports for rospy
and any necessary ROS message types:
import rospy from std_msgs.msg import String
- Initialize the ROS Node
Initialize a ROS node at the beginning of your code:
rospy.init_node('camera_detection_node', anonymous=True)
- Define Topic Publisher/Subscriber
Based on the requirements, define a publisher or subscriber. For example, to publish QR code detection results:
pub = rospy.Publisher('qr_detection', String, queue_size=10) rate = rospy.Rate(10) # 10 Hz
Then, you can set up a function to detect QR codes and publish the results. For example:
# Assuming there is a function to detect QR codes
def detect_qr_code():
while not rospy.is_shutdown():
# Detection logic here
detection_result = "QR code detected" # This is the detection result
rospy.loginfo(detection_result)
pub.publish(detection_result)
rate.sleep()
Code Example
Below is a simplified code snippet showing how to publish QR code detection results in camera_detect.py
:
#!/usr/bin/env python
import rospy
from std_msgs.msg import String
def detect_qr_code():
pub = rospy.Publisher('qr_detection', String, queue_size=10)
rospy.init_node('camera_detection_node', anonymous=True)
rate = rospy.Rate(10) # 10 Hz
while not rospy.is_shutdown():
# Replace with actual detection logic
detection_result = "QR code detected" # Simulated detection result
rospy.loginfo(detection_result)
pub.publish(detection_result)
rate.sleep()
if __name__ == '__main__':
try:
detect_qr_code()
except rospy.ROSInterruptException:
pass
Note : Ensure the Python files are executable by running
chmod +x ~/catkin_ws/src/qr_tracking/scripts/*.py
.
Configuring the CMakeLists.txt
File
Overview of CMake Configuration
In ROS, the CMakeLists.txt
file is a core configuration file for each package, specifying how to compile and install files within the package. It includes configuration details like compiler options, library dependencies, and installation paths. For Python scripts to function as ROS nodes, we need to make a few necessary adjustments to this file.
Modifying CMakeLists.txt
To make the Python scripts executable within ROS, follow these steps:
- Add Catkin Build Dependencies
Ensure CMakeLists.txt
includes a find_package
statement to locate catkin
and the necessary ROS dependencies, such as rospy
and std_msgs
. Here’s an example:
cmake_minimum_required(VERSION 2.8.3)
project(mycobot_280)
add_compile_options(-std=c++11)
## Find catkin and any catkin packages
find_package(catkin REQUIRED COMPONENTS
roscpp
rospy
std_msgs
actionlib
image_transport
cv_bridge
)
- Install Python Scripts
Use catkin_install_python
to specify the installation path for Python scripts and to ensure they have executable permissions. Assuming your Python scripts are located in the scripts
directory, add the following section to CMakeLists.txt
:
catkin_install_python(PROGRAMS
scripts/follow_display.py
scripts/slider_control.py
scripts/teleop_keyboard.py
scripts/listen_real.py
scripts/listen_real_of_topic.py
scripts/simple_gui.py
scripts/follow_display_gripper.py
scripts/slider_control_gripper.py
scripts/listen_real_gripper.py
scripts/detect_stag.py
DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
)
This command installs the Python scripts to the ROS package’s binary directory and ensures they have executable permissions after compilation.
- Add Dependencies
Before calling catkin_package()
, declare the dependencies to ensure ROS correctly resolves them. For example:
catkin_package( CATKIN_DEPENDS std_msgs actionlib )
- Complete Example
Here is a sample configuration for the CMakeLists.txt
file:
cmake_minimum_required(VERSION 2.8.3)
project(mycobot_280)
add_compile_options(-std=c++11)
## Find catkin and any catkin packages
find_package(catkin REQUIRED COMPONENTS
roscpp
rospy
std_msgs
actionlib
image_transport
cv_bridge
)
## Declare a catkin package
catkin_package(
CATKIN_DEPENDS std_msgs actionlib
)
## Include directories
include_directories(include ${catkin_INCLUDE_DIRS} ${OpenCV_INCLUDE_DIRS})
## Install Python scripts
catkin_install_python(PROGRAMS
scripts/follow_display.py
scripts/slider_control.py
scripts/teleop_keyboard.py
scripts/listen_real.py
scripts/listen_real_of_topic.py
scripts/simple_gui.py
scripts/follow_display_gripper.py
scripts/slider_control_gripper.py
scripts/listen_real_gripper.py
scripts/detect_stag.py
DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION}
)
## Install launch and config directories
install(DIRECTORY launch DESTINATION ${CATKIN_PACKAGE_SHARE_DESTINATION}
PATTERN "setup_assistant.launch" EXCLUDE)
install(DIRECTORY config DESTINATION ${CATKIN_PACKAGE_SHARE_DESTINATION})
## OpenCV requirements
find_package(OpenCV REQUIRED)
add_executable(opencv_camera src/opencv_camera)
target_link_libraries(opencv_camera ${catkin_LIBRARIES} ${OpenCV_LIBRARIES})
add_executable(camera_display src/camera_display)
target_link_libraries(camera_display ${catkin_LIBRARIES} ${OpenCV_LIBRARIES})
With these modifications, the Python scripts will be part of the ROS package, given executable permissions, and runnable using ROS tools such as rosrun
.
This section is crucial for guiding users on how to compile, start, and verify the project’s functionality in ROS.
6. Compiling and Running
Compiling the Workspace
After configuring all aspects of your ROS package, you need to compile the workspace to generate and configure the necessary resources.
- Ensure you are in the root directory of the workspace:
cd ~/catkin_ws
- Run
catkin_make
to compile the workspace:
catkin_make
If the compilation succeeds, you should see output similar to:
[100%] Built target qr_tracking
Launching the Node
Once compilation is complete, you can use rosrun
to start the QR code tracking node.
- Ensure that the workspace environment variables are loaded, and launch the simulation model:
cd ~/catkin_ws source devel/setup.bash roslaunch mycobot_280 detect_marker_with_topic.launch port:=/dev/ttyUSB0 baud:=115200
- Use
rosrun
to start thecamera_detect.py
script:
rosrun qr_tracking camera_detect.py
You should see output indicating that the ROS node has been initialized, and it will begin publishing QR code detection results.
GitHub:
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: GaussianRPG v2.0: the first open-source hardware-in-the-loop simulation system demo using 3D Gaussian Splatting tech
GaussianRPG v2.0 has been launched!!The first open-source hardware-in-the-loop simulation system demo using 3D Gaussian Splatting tech.
(GitHub - GimpelZhang/GaussianRPG: 3D Gaussian Rendering PlayGround: an open-source autonomous driving closed-loop simulator demo using 3D Gaussian Splatting tech)
In v2.0 version, a hardware-in-the-loop simulation system demo is developed based on v1.0 and a D-Robotics RDK X5 suite, similar to the RaspBerry PI (https://developer.d-robotics.cc/rdk_doc/en/RDK).
The other key part of the HIL system is the image stream injection device, which simulates the camera. I find a chip suite which works as a HDMI to USB converter. So this RER-H2U-V2 chip can take the image stream from HDMI as input, and output it through USB interface, working as an USB camera connected to the RDK suite.
I believe that this kind of 3DGS simulator and robot-controller-in-the-loop frame can also be used in embodied intelligence robot simulation.
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: ROS News for the Week of February 10th, 2025
ROS News for the Week of February 10th, 2025
Our friends at ros-controls have joined the OSRA family of projects. Welcome to the team @bmagyar, @christophfroehlich, @destogl and @saikishor!
There is now a dark theme configuration for RViz / RViz2!
Our colleague @sAmUko has released the MoboBot Robot. It looks like a really well put together educational robot using ROS 2 and Gazebo.
Check out this really cool LLM-based CLI utility for creating simulation worlds. The entire Gazebo team was really impressed with this project. Here’s a Discourse post on the project that went up right after I posted the news
Events
- 2025-02-12 Embodied AI Community Group #4
- 2025-02-11 Zenoh Advanced Features Workshop w/ Zettascale – Calendar Invite
- 2025-02-19 DroneCode South California Meetup #1
- 2025-02-20 Aerial Robotics meeting
- 2025-02-21 Nav2 / ROS Bangalore Meet Up
- 2025-02-22 Pan-African Robotics Competition Deadline
- 2025-02-22 ROS Meetup Lagos, Nigeria
- 2025-02-27 ROS Meetup Barcelona
- 2025-02-27 Zürich Robotics Meetup
- 2025-04-28 International Workshop on Robotics Software Engineering
- 2025-04-30 Robotics Summit & Expo wsg @gbiggs.
- 2025-05-15 ROS-Industrial Consortium Americas 2025 Annual Meeting Detroit
- 2025-05-23 ICRA 2025 Advancing Quantitative and QUAlitative SIMulators for marine applications
- 2025-05-30 => 2025-05-31 2025 Open Hardware Summit in Edinburgh
News
ros-controls Joins the OSRA Family of Projects
- Meet @mjcarroll, your interim ROS Project Lead
- ROS PMC meeting minutes 2025-02-11
- Indy Autonomous Challenge RACECAR DATA set
- Drone Code Newsletter
- How Smell Could Transform Robotics: The Next Frontier in Sensing
- Dronecode hits $1 billion in project value
- Zetta Radio: A Journey from Smart Cities to Robotics and Beyond with Zenoh
ICRA 2025 Travel Support
- Video Roundup
- Robot Cameras at the Superbowl – I suspect they run ROS.
- Topcon Agriculture teams up with Bonsai Robotics on precision farming - The Robot Report
- SAEKI raises $6.7M to scale robots for manufacturing
- Carbon Robotics’ LaserWeeder G2 destroys weeds even faster
- Avride launches sidewalk delivery bots on Uber Eats in Jersey City | TechCrunch
- Apptronik, which makes humanoid robots, raises $350M as category heats up | TechCrunch
- A Roboticist Visits FOSDEM 2025
ROS
ROSCon India 2024 Videos on YouTube
- Upcoming switch of Windows installation to pixi/conda
- New packages for Humble Hawksbill 2025-02-14
- New Packages for Noetic
- New Packages for Jazzy Jalisco 2025-02-10
A dark theme configuration for RViz/RViz2
- ROSCon JP Call for Workshops
- Useful Tool for Calculating Rotations
LLM-based CLI utility for simulation worlds creation.
New MoboBot Robot Documentation
- ROS 2: use_sim_time leads to inconsistent clocks
- Additional levels in DiagnosticStatus
- RobotCAD 6 - Reforged released!
- Elevator pitch for vcstool alternative
- Type hinting for ROS 2 Python messages
- Useful ROS Easily Connect Controller and Real Cobot
- Announcing ROS 2 Easy Mode
- Drive UR Dual-Arm Robots in ROS RViz with Our Own Arms
- Tool extensions for ros2bag cli
- A simple, but powerful UI toolset for various ROS 2 utilities
- Open Duck Mini: Making a mini version of the BDX droid
- A Tale of Two Formulas: Benchmarking the Nav2 AMCL Likelihood Field Sensor Model
- HiPeRT-Lab’s Roboracer autonomous racing stack
- Articulated Robotics: How to make custom Gazebo worlds for your robot
- Rotation Calculator from Articulated Robotics
- nomeer_robot_ros2: Autonomous Mobile Robot
- Bridging the Gap: Writing Portable C++ Programs for CPU and GPU CppCon 2024
- List of Visual re-Localization Algorithms
- Ardupilot Log inspection with PlotJuggler
- How to bridge communication across different ROS 2 domains
- GNSS/INS/Camera Integrated Navigation Library
- Tier4 Umber DDS
- Present and Future of SLAM in Extreme Environments
- TKG Ball Catching Robot
- PaTS-Wheel: A Passively-Transformable Single-Part Wheel for Mobile Robot Navigation
- Performance Optimization in Software Development - Being Friendly to Your Hardware
- MAGICVFM-Meta-Learning Adaptation for Ground Interaction Control With Visual Foundation Models
- Oxford Spires Dataset
- Multi robot launch in Gazebo and multi robots control with namespace
- A GNSS/INS Integrated Navigation System with a Wheel-mounted IMU
Got a Minute data:image/s3,"s3://crabby-images/f163d/f163de6b4e50eee44073e7a96028c3ec0a29dc61" alt=":mantelpiece_clock: :mantelpiece_clock:"
We had two items this week that are looking for feedback.
- Requesting help: Let’s make ROS 2 dictionary for spell checker
- Requesting feedback: new for-loop action for ROS 2 launch files to repeat entities
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: New packages for ROS 2 Rolling Ridley 2025-02-14
Hello everyone!
We’re happy to announce 4 new package and 204 updates are now available in ROS 2 Rolling Ridley
This sync was tagged as rolling/2025-02-14
.
Package Updates for rolling
Added Packages [4]:
- ros-rolling-battery-state-broadcaster: 1.0.1-1
- ros-rolling-battery-state-broadcaster-dbgsym: 1.0.1-1
- ros-rolling-performance-test: 2.3.0-1
- ros-rolling-performance-test-dbgsym: 2.3.0-1
Updated Packages [204]:
- ros-rolling-ackermann-steering-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-ackermann-steering-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-admittance-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-admittance-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-backward-ros: 1.0.6-1 → 1.0.7-1
- ros-rolling-backward-ros-dbgsym: 1.0.6-1 → 1.0.7-1
- ros-rolling-battery-state-rviz-overlay: 1.0.0-1 → 1.0.1-1
- ros-rolling-battery-state-rviz-overlay-dbgsym: 1.0.0-1 → 1.0.1-1
- ros-rolling-bicycle-steering-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-bicycle-steering-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-camera-calibration: 6.0.7-1 → 6.0.9-1
- ros-rolling-compressed-depth-image-transport: 5.0.1-1 → 5.0.2-1
- ros-rolling-compressed-depth-image-transport-dbgsym: 5.0.1-1 → 5.0.2-1
- ros-rolling-compressed-image-transport: 5.0.1-1 → 5.0.2-1
- ros-rolling-compressed-image-transport-dbgsym: 5.0.1-1 → 5.0.2-1
- ros-rolling-control-toolbox: 3.5.0-1 → 4.0.1-1
- ros-rolling-control-toolbox-dbgsym: 3.5.0-1 → 4.0.1-1
- ros-rolling-controller-interface: 4.24.0-1 → 4.26.0-1
- ros-rolling-controller-interface-dbgsym: 4.24.0-1 → 4.26.0-1
- ros-rolling-controller-manager: 4.24.0-1 → 4.26.0-1
- ros-rolling-controller-manager-dbgsym: 4.24.0-1 → 4.26.0-1
- ros-rolling-controller-manager-msgs: 4.24.0-1 → 4.26.0-1
- ros-rolling-controller-manager-msgs-dbgsym: 4.24.0-1 → 4.26.0-1
- ros-rolling-depth-image-proc: 6.0.7-1 → 6.0.9-1
- ros-rolling-depth-image-proc-dbgsym: 6.0.7-1 → 6.0.9-1
- ros-rolling-diagnostic-aggregator: 4.3.1-1 → 4.4.2-1
- ros-rolling-diagnostic-aggregator-dbgsym: 4.3.1-1 → 4.4.2-1
- ros-rolling-diagnostic-common-diagnostics: 4.3.1-1 → 4.4.2-1
- ros-rolling-diagnostic-updater: 4.3.1-1 → 4.4.2-1
- ros-rolling-diagnostic-updater-dbgsym: 4.3.1-1 → 4.4.2-1
- ros-rolling-diagnostics: 4.3.1-1 → 4.4.2-1
- ros-rolling-diff-drive-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-diff-drive-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-dynamixel-sdk: 3.7.40-5 → 3.8.1-1
- ros-rolling-dynamixel-sdk-custom-interfaces: 3.7.40-5 → 3.8.1-1
- ros-rolling-dynamixel-sdk-custom-interfaces-dbgsym: 3.7.40-5 → 3.8.1-1
- ros-rolling-dynamixel-sdk-dbgsym: 3.7.40-5 → 3.8.1-1
- ros-rolling-dynamixel-sdk-examples: 3.7.40-5 → 3.8.1-1
- ros-rolling-dynamixel-sdk-examples-dbgsym: 3.7.40-5 → 3.8.1-1
- ros-rolling-effort-controllers: 4.19.0-1 → 4.20.0-1
- ros-rolling-effort-controllers-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-force-torque-sensor-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-rolling-force-torque-sensor-broadcaster-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-forward-command-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-forward-command-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-foxglove-bridge: 0.8.2-1 → 0.8.3-1
- ros-rolling-foxglove-bridge-dbgsym: 0.8.2-1 → 0.8.3-1
- ros-rolling-foxglove-msgs: 3.0.1-1 → 3.1.0-1
- ros-rolling-foxglove-msgs-dbgsym: 3.0.1-1 → 3.1.0-1
- ros-rolling-gpio-controllers: 4.19.0-1 → 4.20.0-1
- ros-rolling-gpio-controllers-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-gripper-controllers: 4.19.0-1 → 4.20.0-1
- ros-rolling-gripper-controllers-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-gz-tools-vendor: 0.1.1-1 → 0.1.2-1
- ros-rolling-gz-tools-vendor-dbgsym: 0.1.1-1 → 0.1.2-1
- ros-rolling-hardware-interface: 4.24.0-1 → 4.26.0-1
- ros-rolling-hardware-interface-dbgsym: 4.24.0-1 → 4.26.0-1
- ros-rolling-hardware-interface-testing: 4.24.0-1 → 4.26.0-1
- ros-rolling-hardware-interface-testing-dbgsym: 4.24.0-1 → 4.26.0-1
- ros-rolling-image-pipeline: 6.0.7-1 → 6.0.9-1
- ros-rolling-image-proc: 6.0.7-1 → 6.0.9-1
- ros-rolling-image-proc-dbgsym: 6.0.7-1 → 6.0.9-1
- ros-rolling-image-publisher: 6.0.7-1 → 6.0.9-1
- ros-rolling-image-publisher-dbgsym: 6.0.7-1 → 6.0.9-1
- ros-rolling-image-rotate: 6.0.7-1 → 6.0.9-1
- ros-rolling-image-rotate-dbgsym: 6.0.7-1 → 6.0.9-1
- ros-rolling-image-transport-plugins: 5.0.1-1 → 5.0.2-1
- ros-rolling-image-view: 6.0.7-1 → 6.0.9-1
- ros-rolling-image-view-dbgsym: 6.0.7-1 → 6.0.9-1
- ros-rolling-imu-sensor-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-rolling-imu-sensor-broadcaster-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-joint-limits: 4.24.0-1 → 4.26.0-1
- ros-rolling-joint-limits-dbgsym: 4.24.0-1 → 4.26.0-1
- ros-rolling-joint-state-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-rolling-joint-state-broadcaster-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-joint-trajectory-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-joint-trajectory-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-kitti-metrics-eval: 1.6.0-1 → 1.6.1-1
- ros-rolling-kitti-metrics-eval-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mecanum-drive-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-mecanum-drive-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-message-filters: 7.0.0-1 → 7.0.1-1
- ros-rolling-message-filters-dbgsym: 7.0.0-1 → 7.0.1-1
- ros-rolling-mola: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-bridge-ros2: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-bridge-ros2-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-demos: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-euroc-dataset: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-euroc-dataset-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-kitti-dataset: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-kitti-dataset-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-kitti360-dataset: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-kitti360-dataset-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-mulran-dataset: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-mulran-dataset-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-paris-luco-dataset: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-paris-luco-dataset-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-rawlog: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-rawlog-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-rosbag2: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-input-rosbag2-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-kernel: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-kernel-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-launcher: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-launcher-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-metric-maps: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-metric-maps-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-msgs: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-msgs-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-pose-list: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-pose-list-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-relocalization: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-relocalization-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-traj-tools: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-traj-tools-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-viz: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-viz-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-yaml: 1.6.0-1 → 1.6.1-1
- ros-rolling-mola-yaml-dbgsym: 1.6.0-1 → 1.6.1-1
- ros-rolling-moveit-visual-tools: 4.1.1-1 → 4.1.2-1
- ros-rolling-moveit-visual-tools-dbgsym: 4.1.1-1 → 4.1.2-1
- ros-rolling-mvsim: 0.13.0-1 → 0.13.2-1
- ros-rolling-mvsim-dbgsym: 0.13.0-1 → 0.13.2-1
- ros-rolling-ntrip-client-node: 0.5.4-3 → 0.5.5-4
- ros-rolling-ntrip-client-node-dbgsym: 0.5.4-3 → 0.5.5-4
- ros-rolling-pal-statistics: 2.6.0-1 → 2.6.2-1
- ros-rolling-pal-statistics-dbgsym: 2.6.0-1 → 2.6.2-1
- ros-rolling-pal-statistics-msgs: 2.6.0-1 → 2.6.2-1
- ros-rolling-pal-statistics-msgs-dbgsym: 2.6.0-1 → 2.6.2-1
- ros-rolling-parallel-gripper-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-parallel-gripper-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-pid-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-pid-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-pose-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-rolling-pose-broadcaster-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-position-controllers: 4.19.0-1 → 4.20.0-1
- ros-rolling-position-controllers-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-qml-ros2-plugin: 1.0.1-1 → 2.25.2-2
- ros-rolling-qml-ros2-plugin-dbgsym: 1.0.1-1 → 2.25.2-2
- ros-rolling-range-sensor-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-rolling-range-sensor-broadcaster-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-rmw-zenoh-cpp: 0.3.0-1 → 0.3.1-1
- ros-rolling-rmw-zenoh-cpp-dbgsym: 0.3.0-1 → 0.3.1-1
- ros-rolling-ros-babel-fish: 0.10.2-1 → 3.25.2-1
- ros-rolling-ros-babel-fish-dbgsym: 0.10.2-1 → 3.25.2-1
- ros-rolling-ros-babel-fish-test-msgs: 0.10.2-1 → 3.25.2-1
- ros-rolling-ros-babel-fish-test-msgs-dbgsym: 0.10.2-1 → 3.25.2-1
- ros-rolling-ros-gz: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-bridge: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-bridge-dbgsym: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-image: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-image-dbgsym: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-interfaces: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-interfaces-dbgsym: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-sim: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-sim-dbgsym: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros-gz-sim-demos: 2.1.3-2 → 2.1.4-1
- ros-rolling-ros2-control: 4.24.0-1 → 4.26.0-1
- ros-rolling-ros2-control-test-assets: 4.24.0-1 → 4.26.0-1
- ros-rolling-ros2-controllers: 4.19.0-1 → 4.20.0-1
- ros-rolling-ros2-controllers-test-nodes: 4.19.0-1 → 4.20.0-1
- ros-rolling-ros2controlcli: 4.24.0-1 → 4.26.0-1
- ros-rolling-rqt-controller-manager: 4.24.0-1 → 4.26.0-1
- ros-rolling-rqt-joint-trajectory-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-rqt-plot: 1.6.0-1 → 1.6.2-1
- ros-rolling-self-test: 4.3.1-1 → 4.4.2-1
- ros-rolling-self-test-dbgsym: 4.3.1-1 → 4.4.2-1
- ros-rolling-steering-controllers-library: 4.19.0-1 → 4.20.0-1
- ros-rolling-steering-controllers-library-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-stereo-image-proc: 6.0.7-1 → 6.0.9-1
- ros-rolling-stereo-image-proc-dbgsym: 6.0.7-1 → 6.0.9-1
- ros-rolling-test-ros-gz-bridge: 2.1.3-2 → 2.1.4-1
- ros-rolling-theora-image-transport: 5.0.1-1 → 5.0.2-1
- ros-rolling-theora-image-transport-dbgsym: 5.0.1-1 → 5.0.2-1
- ros-rolling-tracetools-image-pipeline: 6.0.7-1 → 6.0.9-1
- ros-rolling-tracetools-image-pipeline-dbgsym: 6.0.7-1 → 6.0.9-1
- ros-rolling-transmission-interface: 4.24.0-1 → 4.26.0-1
- ros-rolling-transmission-interface-dbgsym: 4.24.0-1 → 4.26.0-1
- ros-rolling-tricycle-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-tricycle-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-tricycle-steering-controller: 4.19.0-1 → 4.20.0-1
- ros-rolling-tricycle-steering-controller-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-ublox-dgnss: 0.5.4-3 → 0.5.5-4
- ros-rolling-ublox-dgnss-node: 0.5.4-3 → 0.5.5-4
- ros-rolling-ublox-dgnss-node-dbgsym: 0.5.4-3 → 0.5.5-4
- ros-rolling-ublox-nav-sat-fix-hp-node: 0.5.4-3 → 0.5.5-4
- ros-rolling-ublox-nav-sat-fix-hp-node-dbgsym: 0.5.4-3 → 0.5.5-4
- ros-rolling-ublox-ubx-interfaces: 0.5.4-3 → 0.5.5-4
- ros-rolling-ublox-ubx-interfaces-dbgsym: 0.5.4-3 → 0.5.5-4
- ros-rolling-ublox-ubx-msgs: 0.5.4-3 → 0.5.5-4
- ros-rolling-ublox-ubx-msgs-dbgsym: 0.5.4-3 → 0.5.5-4
- ros-rolling-velocity-controllers: 4.19.0-1 → 4.20.0-1
- ros-rolling-velocity-controllers-dbgsym: 4.19.0-1 → 4.20.0-1
- ros-rolling-yasmin: 3.0.3-1 → 3.1.0-1
- ros-rolling-yasmin-demos: 3.0.3-1 → 3.1.0-1
- ros-rolling-yasmin-demos-dbgsym: 3.0.3-1 → 3.1.0-1
- ros-rolling-yasmin-msgs: 3.0.3-1 → 3.1.0-1
- ros-rolling-yasmin-msgs-dbgsym: 3.0.3-1 → 3.1.0-1
- ros-rolling-yasmin-ros: 3.0.3-1 → 3.1.0-1
- ros-rolling-yasmin-viewer: 3.0.3-1 → 3.1.0-1
- ros-rolling-zenoh-cpp-vendor: 0.3.0-1 → 0.3.1-1
- ros-rolling-zenoh-cpp-vendor-dbgsym: 0.3.0-1 → 0.3.1-1
- ros-rolling-zstd-image-transport: 5.0.1-1 → 5.0.2-1
- ros-rolling-zstd-image-transport-dbgsym: 5.0.1-1 → 5.0.2-1
Removed Packages [0]:
Thanks to all ROS maintainers who make packages available to the ROS community. The above list of packages was made possible by the work of the following maintainers:
- Addisu Z. Taddese
- Aditya Pande
- Alejandro Hernandez
- Alejandro Hernandez Cordero
- Apex AI, Inc.
- Austin Hendrix
- Bence Magyar
- Brandon Ong
- Dave Coleman
- Foxglove
- Geoff Sokoll
- Geoffrey Biggs
- Hans-Joachim Krauch
- Jonas Otto
- Jordan Palacios
- Jose Luis Blanco-Claraco
- Jose-Luis Blanco-Claraco
- Kenji Brameld
- Miguel Ángel González Santamarta
- Nick Hortovanyi
- Pyo
- Stefan Fabian
- Victor López
- Vincent Rabaud
- Víctor Mayoral-Vilches
- Yadunund
- miguel
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: Rethink Robotics Baxter robot - retrofit?
Anyone have any documentation on the Rethink Robotics Baxter robot? I have picked up a set of arms from one, and eventually I should have the torso portion with the computer. I’m certain that I’ll be missing various components to it. So I was wondering what options might be out there for the control of the arms? It appears that there are 7 motors/axis in each arm. Made from brushless motors with resolvers. I plan to mount it all on a old electric wheelchair base. I’d also like to add in a stereo camera system to allow depth perception and operation from a headset.
5 posts - 2 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: New packages for Humble Hawksbill 2025-02-14
Package Updates for Humble
Added Packages [16]:
- ros-humble-autoware-internal-planning-msgs: 1.5.0-1
- ros-humble-autoware-internal-planning-msgs-dbgsym: 1.5.0-1
- ros-humble-bondpy: 4.1.2-1
- ros-humble-franka-gripper: 1.0.0-1
- ros-humble-franka-gripper-dbgsym: 1.0.0-1
- ros-humble-franka-msgs: 1.0.0-1
- ros-humble-franka-msgs-dbgsym: 1.0.0-1
- ros-humble-integration-launch-testing: 1.0.0-1
- ros-humble-kompass: 0.2.1-1
- ros-humble-kompass-interfaces: 0.2.1-1
- ros-humble-kompass-interfaces-dbgsym: 0.2.1-1
- ros-humble-nonpersistent-voxel-layer: 2.3.1-1
- ros-humble-nonpersistent-voxel-layer-dbgsym: 2.3.1-1
- ros-humble-py-trees-ros-tutorials: 2.3.0-1
- ros-humble-urinterfaces: 7.0.0-1
- ros-humble-urinterfaces-dbgsym: 7.0.0-1
Updated Packages [357]:
- ros-humble-automatika-ros-sugar: 0.2.6-1 → 0.2.7-1
- ros-humble-automatika-ros-sugar-dbgsym: 0.2.6-1 → 0.2.7-1
- ros-humble-autoware-internal-debug-msgs: 1.3.0-1 → 1.5.0-1
- ros-humble-autoware-internal-debug-msgs-dbgsym: 1.3.0-1 → 1.5.0-1
- ros-humble-autoware-internal-msgs: 1.3.0-1 → 1.5.0-1
- ros-humble-autoware-internal-msgs-dbgsym: 1.3.0-1 → 1.5.0-1
- ros-humble-autoware-internal-perception-msgs: 1.3.0-1 → 1.5.0-1
- ros-humble-autoware-internal-perception-msgs-dbgsym: 1.3.0-1 → 1.5.0-1
- ros-humble-backward-ros: 1.0.6-1 → 1.0.7-1
- ros-humble-backward-ros-dbgsym: 1.0.6-1 → 1.0.7-1
- ros-humble-bond: 3.0.2-3 → 4.1.2-1
- ros-humble-bond-core: 3.0.2-3 → 4.1.2-1
- ros-humble-bond-dbgsym: 3.0.2-3 → 4.1.2-1
- ros-humble-bondcpp: 3.0.2-3 → 4.1.2-1
- ros-humble-bondcpp-dbgsym: 3.0.2-3 → 4.1.2-1
- ros-humble-chomp-motion-planner: 2.5.7-1 → 2.5.8-1
- ros-humble-chomp-motion-planner-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-compressed-depth-image-transport: 2.5.2-1 → 2.5.3-1
- ros-humble-compressed-depth-image-transport-dbgsym: 2.5.2-1 → 2.5.3-1
- ros-humble-compressed-image-transport: 2.5.2-1 → 2.5.3-1
- ros-humble-compressed-image-transport-dbgsym: 2.5.2-1 → 2.5.3-1
- ros-humble-controller-interface: 2.47.0-1 → 2.48.0-1
- ros-humble-controller-interface-dbgsym: 2.47.0-1 → 2.48.0-1
- ros-humble-controller-manager: 2.47.0-1 → 2.48.0-1
- ros-humble-controller-manager-dbgsym: 2.47.0-1 → 2.48.0-1
- ros-humble-controller-manager-msgs: 2.47.0-1 → 2.48.0-1
- ros-humble-controller-manager-msgs-dbgsym: 2.47.0-1 → 2.48.0-1
- ros-humble-costmap-queue: 1.1.17-1 → 1.1.18-1
- ros-humble-costmap-queue-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-diagnostic-aggregator: 4.0.0-1 → 4.0.2-1
- ros-humble-diagnostic-aggregator-dbgsym: 4.0.0-1 → 4.0.2-1
- ros-humble-diagnostic-common-diagnostics: 4.0.0-1 → 4.0.2-1
- ros-humble-diagnostic-updater: 4.0.0-1 → 4.0.2-1
- ros-humble-diagnostic-updater-dbgsym: 4.0.0-1 → 4.0.2-1
- ros-humble-diagnostics: 4.0.0-1 → 4.0.2-1
- ros-humble-dwb-core: 1.1.17-1 → 1.1.18-1
- ros-humble-dwb-core-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-dwb-critics: 1.1.17-1 → 1.1.18-1
- ros-humble-dwb-critics-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-dwb-msgs: 1.1.17-1 → 1.1.18-1
- ros-humble-dwb-msgs-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-dwb-plugins: 1.1.17-1 → 1.1.18-1
- ros-humble-dwb-plugins-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-eigen-stl-containers: 1.0.0-4 → 1.1.0-1
- ros-humble-examples-tf2-py: 0.25.11-1 → 0.25.12-1
- ros-humble-foxglove-bridge: 0.8.2-1 → 0.8.3-1
- ros-humble-foxglove-bridge-dbgsym: 0.8.2-1 → 0.8.3-1
- ros-humble-gazebo-dev: 3.7.0-1 → 3.9.0-1
- ros-humble-gazebo-msgs: 3.7.0-1 → 3.9.0-1
- ros-humble-gazebo-msgs-dbgsym: 3.7.0-1 → 3.9.0-1
- ros-humble-gazebo-plugins: 3.7.0-1 → 3.9.0-1
- ros-humble-gazebo-plugins-dbgsym: 3.7.0-1 → 3.9.0-1
- ros-humble-gazebo-ros: 3.7.0-1 → 3.9.0-1
- ros-humble-gazebo-ros-dbgsym: 3.7.0-1 → 3.9.0-1
- ros-humble-gazebo-ros-pkgs: 3.7.0-1 → 3.9.0-1
- ros-humble-geometric-shapes: 2.3.1-1 → 2.3.2-1
- ros-humble-geometric-shapes-dbgsym: 2.3.1-1 → 2.3.2-1
- ros-humble-geometry2: 0.25.11-1 → 0.25.12-1
- ros-humble-grid-map: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-cmake-helpers: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-core: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-costmap-2d: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-cv: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-cv-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-demos: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-demos-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-filters: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-filters-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-loader: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-loader-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-msgs: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-msgs-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-octomap: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-pcl: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-pcl-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-ros: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-ros-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-rviz-plugin: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-rviz-plugin-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-sdf: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-visualization: 2.0.0-1 → 2.0.1-1
- ros-humble-grid-map-visualization-dbgsym: 2.0.0-1 → 2.0.1-1
- ros-humble-hardware-interface: 2.47.0-1 → 2.48.0-1
- ros-humble-hardware-interface-dbgsym: 2.47.0-1 → 2.48.0-1
- ros-humble-hardware-interface-testing: 2.47.0-1 → 2.48.0-1
- ros-humble-hardware-interface-testing-dbgsym: 2.47.0-1 → 2.48.0-1
- ros-humble-hebi-cpp-api: 3.10.0-1 → 3.12.3-1
- ros-humble-hebi-cpp-api-dbgsym: 3.10.0-1 → 3.12.3-1
- ros-humble-ign-ros2-control: 0.7.9-1 → 0.7.11-1
- ros-humble-ign-ros2-control-dbgsym: 0.7.9-1 → 0.7.11-1
- ros-humble-ign-ros2-control-demos: 0.7.9-1 → 0.7.11-1
- ros-humble-ign-ros2-control-demos-dbgsym: 0.7.9-1 → 0.7.11-1
- ros-humble-image-transport-plugins: 2.5.2-1 → 2.5.3-1
- ros-humble-joint-limits: 2.47.0-1 → 2.48.0-1
- ros-humble-joint-limits-dbgsym: 2.47.0-1 → 2.48.0-1
- ros-humble-kitti-metrics-eval: 1.5.1-1 → 1.6.0-1
- ros-humble-kitti-metrics-eval-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-launch-pal: 0.7.0-1 → 0.10.0-1
- ros-humble-libfranka: 0.13.6-1 → 0.15.0-1
- ros-humble-libfranka-dbgsym: 0.13.6-1 → 0.15.0-1
- ros-humble-mapviz: 2.4.4-1 → 2.4.5-1
- ros-humble-mapviz-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-humble-mapviz-interfaces: 2.4.4-1 → 2.4.5-1
- ros-humble-mapviz-interfaces-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-humble-mapviz-plugins: 2.4.4-1 → 2.4.5-1
- ros-humble-mapviz-plugins-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-humble-mola: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-bridge-ros2: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-bridge-ros2-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-demos: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-euroc-dataset: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-euroc-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-kitti-dataset: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-kitti-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-kitti360-dataset: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-kitti360-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-mulran-dataset: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-mulran-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-paris-luco-dataset: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-paris-luco-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-rawlog: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-rawlog-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-rosbag2: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-input-rosbag2-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-kernel: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-kernel-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-launcher: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-launcher-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-lidar-odometry: 0.5.4-1 → 0.6.1-1
- ros-humble-mola-lidar-odometry-dbgsym: 0.5.4-1 → 0.6.1-1
- ros-humble-mola-metric-maps: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-metric-maps-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-msgs: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-msgs-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-pose-list: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-pose-list-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-relocalization: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-relocalization-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-traj-tools: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-traj-tools-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-viz: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-viz-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-yaml: 1.5.1-1 → 1.6.0-1
- ros-humble-mola-yaml-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-humble-moveit: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-chomp-optimizer-adapter: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-chomp-optimizer-adapter-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-common: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-configs-utils: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-core: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-core-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-hybrid-planning: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-hybrid-planning-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-kinematics: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-kinematics-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-planners: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-planners-chomp: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-planners-chomp-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-planners-ompl: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-planners-ompl-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-plugins: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-resources-prbt-ikfast-manipulator-plugin: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-resources-prbt-ikfast-manipulator-plugin-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-resources-prbt-moveit-config: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-resources-prbt-pg70-support: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-resources-prbt-support: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-benchmarks: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-benchmarks-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-control-interface: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-control-interface-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-move-group: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-move-group-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-occupancy-map-monitor: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-occupancy-map-monitor-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-perception: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-perception-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-planning: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-planning-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-planning-interface: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-planning-interface-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-robot-interaction: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-robot-interaction-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-visualization: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-visualization-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-warehouse: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-ros-warehouse-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-runtime: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-servo: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-servo-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-app-plugins: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-app-plugins-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-assistant: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-assistant-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-controllers: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-controllers-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-core-plugins: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-core-plugins-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-framework: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-framework-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-srdf-plugins: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-setup-srdf-plugins-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-simple-controller-manager: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-simple-controller-manager-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-moveit-visual-tools: 4.1.1-1 → 4.1.2-1
- ros-humble-moveit-visual-tools-dbgsym: 4.1.1-1 → 4.1.2-1
- ros-humble-mp2p-icp: 1.6.4-1 → 1.6.5-1
- ros-humble-mp2p-icp-dbgsym: 1.6.4-1 → 1.6.5-1
- ros-humble-multires-image: 2.4.4-1 → 2.4.5-1
- ros-humble-multires-image-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-humble-mvsim: 0.13.0-1 → 0.13.2-1
- ros-humble-mvsim-dbgsym: 0.13.0-1 → 0.13.2-1
- ros-humble-nav-2d-msgs: 1.1.17-1 → 1.1.18-1
- ros-humble-nav-2d-msgs-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav-2d-utils: 1.1.17-1 → 1.1.18-1
- ros-humble-nav-2d-utils-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-amcl: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-amcl-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-behavior-tree: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-behavior-tree-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-behaviors: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-behaviors-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-bringup: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-bt-navigator: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-bt-navigator-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-collision-monitor: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-collision-monitor-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-common: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-constrained-smoother: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-constrained-smoother-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-controller: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-controller-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-core: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-costmap-2d: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-costmap-2d-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-dwb-controller: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-graceful-controller: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-graceful-controller-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-lifecycle-manager: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-lifecycle-manager-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-map-server: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-map-server-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-mppi-controller: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-mppi-controller-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-msgs: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-msgs-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-navfn-planner: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-navfn-planner-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-planner: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-planner-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-regulated-pure-pursuit-controller: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-regulated-pure-pursuit-controller-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-rotation-shim-controller: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-rotation-shim-controller-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-rviz-plugins: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-rviz-plugins-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-simple-commander: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-smac-planner: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-smac-planner-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-smoother: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-smoother-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-system-tests: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-system-tests-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-theta-star-planner: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-theta-star-planner-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-util: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-util-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-velocity-smoother: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-velocity-smoother-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-voxel-grid: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-voxel-grid-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-waypoint-follower: 1.1.17-1 → 1.1.18-1
- ros-humble-nav2-waypoint-follower-dbgsym: 1.1.17-1 → 1.1.18-1
- ros-humble-navigation2: 1.1.17-1 → 1.1.18-1
- ros-humble-novatel-oem7-driver: 20.1.0-1 → 20.6.0-1
- ros-humble-novatel-oem7-driver-dbgsym: 20.1.0-1 → 20.6.0-1
- ros-humble-novatel-oem7-msgs: 20.1.0-1 → 20.6.0-1
- ros-humble-novatel-oem7-msgs-dbgsym: 20.1.0-1 → 20.6.0-1
- ros-humble-odom-to-tf-ros2: 1.0.4-1 → 1.0.5-1
- ros-humble-odom-to-tf-ros2-dbgsym: 1.0.4-1 → 1.0.5-1
- ros-humble-pal-statistics: 2.6.0-1 → 2.6.2-1
- ros-humble-pal-statistics-dbgsym: 2.6.0-1 → 2.6.2-1
- ros-humble-pal-statistics-msgs: 2.6.0-1 → 2.6.2-1
- ros-humble-pal-statistics-msgs-dbgsym: 2.6.0-1 → 2.6.2-1
- ros-humble-pilz-industrial-motion-planner: 2.5.7-1 → 2.5.8-1
- ros-humble-pilz-industrial-motion-planner-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-pilz-industrial-motion-planner-testutils: 2.5.7-1 → 2.5.8-1
- ros-humble-pilz-industrial-motion-planner-testutils-dbgsym: 2.5.7-1 → 2.5.8-1
- ros-humble-qml-ros2-plugin: 1.0.1-2 → 1.25.2-1
- ros-humble-qml-ros2-plugin-dbgsym: 1.0.1-2 → 1.25.2-1
- ros-humble-realtime-tools: 2.10.0-1 → 2.11.0-1
- ros-humble-realtime-tools-dbgsym: 2.10.0-1 → 2.11.0-1
- ros-humble-rmw-zenoh-cpp: 0.1.0-1 → 0.1.1-1
- ros-humble-rmw-zenoh-cpp-dbgsym: 0.1.0-1 → 0.1.1-1
- ros-humble-ros-babel-fish: 0.9.4-1 → 0.25.2-1
- ros-humble-ros-babel-fish-dbgsym: 0.9.4-1 → 0.25.2-1
- ros-humble-ros-babel-fish-test-msgs: 0.9.4-1 → 0.25.2-1
- ros-humble-ros-babel-fish-test-msgs-dbgsym: 0.9.4-1 → 0.25.2-1
- ros-humble-ros2-control: 2.47.0-1 → 2.48.0-1
- ros-humble-ros2-control-test-assets: 2.47.0-1 → 2.48.0-1
- ros-humble-ros2controlcli: 2.47.0-1 → 2.48.0-1
- ros-humble-rqt-controller-manager: 2.47.0-1 → 2.48.0-1
- ros-humble-rqt-plot: 1.1.2-1 → 1.1.3-1
- ros-humble-rtabmap: 0.21.9-1 → 0.21.10-1
- ros-humble-rtabmap-dbgsym: 0.21.9-1 → 0.21.10-1
- ros-humble-self-test: 4.0.0-1 → 4.0.2-1
- ros-humble-self-test-dbgsym: 4.0.0-1 → 4.0.2-1
- ros-humble-smclib: 3.0.2-3 → 4.1.2-1
- ros-humble-srdfdom: 2.0.5-1 → 2.0.7-1
- ros-humble-srdfdom-dbgsym: 2.0.5-1 → 2.0.7-1
- ros-humble-tf2: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-bullet: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-dbgsym: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-eigen: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-eigen-kdl: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-eigen-kdl-dbgsym: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-geometry-msgs: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-kdl: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-msgs: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-msgs-dbgsym: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-py: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-py-dbgsym: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-ros: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-ros-dbgsym: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-ros-py: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-sensor-msgs: 0.25.11-1 → 0.25.12-1
- ros-humble-tf2-tools: 0.25.11-1 → 0.25.12-1
- ros-humble-theora-image-transport: 2.5.2-1 → 2.5.3-1
- ros-humble-theora-image-transport-dbgsym: 2.5.2-1 → 2.5.3-1
- ros-humble-tile-map: 2.4.4-1 → 2.4.5-1
- ros-humble-tile-map-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-humble-transmission-interface: 2.47.0-1 → 2.48.0-1
- ros-humble-transmission-interface-dbgsym: 2.47.0-1 → 2.48.0-1
- ros-humble-ur: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-bringup: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-calibration: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-calibration-dbgsym: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-client-library: 1.5.0-1 → 1.6.0-1
- ros-humble-ur-client-library-dbgsym: 1.5.0-1 → 1.6.0-1
- ros-humble-ur-controllers: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-controllers-dbgsym: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-dashboard-msgs: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-dashboard-msgs-dbgsym: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-description: 2.1.9-1 → 2.1.10-1
- ros-humble-ur-moveit-config: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-robot-driver: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-robot-driver-dbgsym: 2.5.1-1 → 2.5.2-1
- ros-humble-ur-simulation-gz: 0.1.0-1 → 0.1.1-2
- ros-humble-yasmin: 3.0.3-1 → 3.1.0-1
- ros-humble-yasmin-demos: 3.0.3-1 → 3.1.0-1
- ros-humble-yasmin-demos-dbgsym: 3.0.3-1 → 3.1.0-1
- ros-humble-yasmin-msgs: 3.0.3-1 → 3.1.0-1
- ros-humble-yasmin-msgs-dbgsym: 3.0.3-1 → 3.1.0-1
- ros-humble-yasmin-ros: 3.0.3-1 → 3.1.0-1
- ros-humble-yasmin-viewer: 3.0.3-1 → 3.1.0-1
- ros-humble-zenoh-cpp-vendor: 0.1.0-1 → 0.1.1-1
- ros-humble-zenoh-cpp-vendor-dbgsym: 0.1.0-1 → 0.1.1-1
Removed Packages [0]:
Thanks to all ROS maintainers who make packages available to the ROS community. The above list of packages was made possible by the work of the following maintainers:
- Alberto Tudela
- Alejandro Hernández
- Alexander Gutenkunst
- Alexey Merzlyakov
- Austin Hendrix
- Automatika Robotics
- Bence Magyar
- Berkay Karaman
- Blake Anderson
- Brian Wilcox
- Carl Delsey
- Carlos Orduno
- Chittaranjan Srinivas Swaminathan
- Chris Bollinger
- Chris Lalancette
- Christian Henkel
- Daniel Stonier
- Dave Coleman
- David V. Lu!!
- Felix Exner
- Franka Robotics GmbH
- Geoffrey Biggs
- George Stavrinos
- Hans-Joachim Krauch
- Henning Kayser
- Jordan Palacios
- Jose Luis Blanco-Claraco
- Kenji Brameld
- M. Fatih Cırıt
- Mabel Zhang
- Matej Vargovcik
- Mathieu Labbe
- Maximilian Wulf
- Michael Görner
- Michael Jeronimo
- Miguel Ángel González Santamarta
- Mohammad Haghighipanah
- MoveIt Release Team
- NovAtel Support
- Raghavender Sahdev
- Ryohsuke Mitsudome
- Southwest Research Institute
- Stefan Fabian
- Steve Macenski
- Tyler Weaver
- Universal Robots A/S
- Victor López
- Yadunund
- Yukihiro Saito
- miguel
- steve
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: New Packages for Noetic 2025-02-13
We’re happy to announce 0 new packages and 2 updates are now available in ROS Noetic. This sync was tagged as noetic/2025-02-13
.
Thank you to every maintainer and contributor who made these updates available!
Package Updates for ROS Noetic
Added Packages [0]:
Updated Packages [2]:
- ros-noetic-foxglove-bridge: 0.8.1-1 → 0.8.3-1
- ros-noetic-mvsim: 0.13.0-1 → 0.13.2-1
Removed Packages [0]:
Thanks to all ROS maintainers who make packages available to the ROS community. The above list of packages was made possible by the work of the following maintainers:
- Hans-Joachim Krauch
- Jose-Luis Blanco-Claraco
7 posts - 4 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: Ros2: use_sim_time leads to inconsistent clocks
Hello everyone,
I think, the current design of simulated clocks and the parameter use_sim_time
lead to major problems and should be reworked. Here are my issues:
The use_sim_time
parameter is available on every node and instructs that node to use the /clock
topic as a time source. This allows nodes to run slower or faster e.g. during simulation or playing a bag file.
In ROS1, this was a global parameter, so every node had the same configuration. However, in ROS2, this parameter needs to be set on each node individually. This is a major design flaw because it is very easy to end up with an inconsistent clock source, leading to unexpected and undefined behavior.
Every node means:
- All simulation launch files
- All launch files and nodes, started separately for testing
- All dynamically loaded Gazebo plugins (that start a Node)
- All GUI tools (rviz, rqt, …)
To make matters worse, ros2 launch
does not have the functionality to set this parameter, so you need to manually insert it in every launch file that you want to start individually in simulation, cluttering the file. And it is very easy to forget to set it.
How many of you created a dedicated launch file for rviz to start it with use_sim_time
for simulation? Probably not many. If not, you ended up with an inconsistent time setup, probably without even realizing it.
It is not a use-case to start a setup with inconsistent clocks. Therefore, it should not be possible. The time source should be unique and identical for all nodes by design.
I think, there is a pretty straight-forward solution. During the transition from ROS1 to ROS2, the robot description was moved from a global parameter to a topic, probably for the same reason. Consequently, the clock should follow the same approach and the /clock
topic exists already.
9 posts - 7 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: RobotCAD 6 - Reforged released!
It gives a set of new tools and improve old ones. Adds new controllers: Mecanum drive controller (with option to generate all code of wheels friction), GPIO controller. Adds new sensor - Wide angle camera.
This release has fixed all found bugs and has reforged collision and inertia generation system that let you create collisions, meshes and calculation of inertia/mass for complex Parts (with many bodies inside) bound to the robot link.
https://github.com/drfenixion/freecad.robotcad
2 posts - 2 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: 📢 ros-controls Joins the OSRA Family of Projects
Today, we are excited to share that ros-controls has officially joined the OSRA family as a governed project! The Open Source Robotics Alliance (OSRA) was created a little less than a year ago with the goal of becoming an umbrella organization for our open source robotics community, and we are excited to bring ros-controls into the organization as our first outside, community-led open source project. ros-controls is a collection of packages for real time robot control using ROS 2. ros-controls is used by a number of well-known robotics organizations such as PickNik Robotics, ROS Industrial, and PAL Robotics and by our estimates ros-controls and its related packages were downloaded close to ten millions times in 2024. For over a decade, ros-controls has played a crucial role in the ROS ecosystem, providing a robust framework for real-time robot control. With OSRA’s support, we are excited to expand our capabilities, strengthen our community, and ensure the future of open-source robotics control software.
What does this mean for ros-controls?
With OSRA’s backing, ros-controls will benefit from:
Long-term sustainability – Ensuring continued development and maintenance.
Improved governance – A structured, community-driven approach to decision-making.
Stronger collaboration – Integration with key robotics projects like ROS, Gazebo, and Open-RMF.
Industry-backed support – Greater involvement from OSRA members, including leading robotics companies.
What does this mean for ros-controls contributors and users?
ros-controls users and contributors probably won’t notice changes to the current development process, but over the next few weeks the following will happen in the background to align the ros-controls project with OSRA’s governance norms:
- The Control WG community group meetings will become official ros-controls Project Management Committee (PMC) meetings.
- The current maintainers, @bmagyar, @christophfroehlich , @destogl and @saikishor will become members of the ros-controls PMC.
- The current maintainer of Gazebo repositories related to ros2_control, @ahcorde , will become a commiter for the ros-controls project.
- @bmagyar will become the project leader and representative to the OSRA Technical Governance Committee (TGC).
- @destogl will become the ros-controls co-leader and replacement for @bmagyar at TGC meetings.
- The public project charter will be posted shortly - this document will outline clear procedures to becoming a ros-controls commiter and a member of the ros-controls PMC.
What’s Next?
We invite developers, researchers, and robotics companies to contribute and be part of this journey. If you’d like to get involved, check out our project at control.ros.org or join our discussions on ROS Discourse and Github.
A huge thank you to our contributors, maintainers, and users who have helped make the ros-controls a success. Your dedication has brought us to this incredible milestone, and we’re looking forward to the next chapter together!
4 posts - 3 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: ROS users meet up at NVIDIA GTC 2025?
Next month, it’s again the NVIDIA ‘GPU Technology Conference’. I expect/hope @ggrigor to post interesting tracks in the next weeks, but this post is to check who’s going and available for a drink/meet-up?
3 posts - 3 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: ROS Meetup Lagos, Nigeria
Hi ROS Devs.,
We are excited to announce another ROS meetup in Lagos, Nigeria!
On 2025-02-22T11:00:00Z UTC→2025-02-22T13:00:00Z UTC @sAmUko, the founder of robocre8, will be taking us through Open-Source Robot and Hardware for Accelerating ROS 2 Development and Learning while Femi Ayoade, a robotics researcher, will walk us through practical implementation of the Linear Quadratic Regulator algorithm.
Our speakers will communicate virtually but the meetup offers more than that and only the people present physically at the event venue will experience the other part of the meetup.
Kindly register for the ROS Meetup Lagos.
Venue: 10, Hughes Avenue, Opposite Westerfield College, Off Herbert Macaulay Way , Yaba, Lagos, Nigeria.
Date: 2025-02-22T11:00:00Z UTC→2025-02-22T13:00:00Z UTC
Contact Email Address : rosnaija.ng@gmail.com
2 posts - 2 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: Additional levels in DiagnosticStatus
Hello. I’m interested in knowing if ROS users would find value adding additional levels in the diagnostic_msgs/DiagnosticStatus
message type.
I work on systems with large amounts of ROS diagnostics and it can often be hard to convey to end users what to focus on when issues occur. Now in ROS diagnostics world you can create custom analyzer plugins (and that’s something I’m working on) but I still fine the OK
, WARN
and ERROR
levels to be a bit limiting.
Taking some inspiration from OpenCyphal’s Severity level message I think the following could be useful.
byte INFO=0 # Purely informational
byte OK=1 # Component's diagnostic is in an OK state
byte NOTICE=2 # Level at which user awareness might be recommended but action is not necessarily required
byte WARN=3 # Begin to bring awareness to users, as there might be an issue
byte ERROR=4 # An error condition has been detected
byte CRITICAL=5 # Failure is imminent
byte ALERT=6 # User attention is required
byte STALE=7 # Reserved for use by the aggregator
The distinction between INFO
and OK
would be in some cases we have a diagnostics that just report some values because it’s convenient but the level is not expected to change, as opposed to a diagnostic reporting OK
which might not always be OK
.
The distinction between ERROR
and CRITICAL
would be the operational context. For example we do a lot of configuration checksum validation at startup. If there’s a mismatch in what we expect that would be an ERROR
. An example of a CRITICAL
level might be critically low battery levels. This is not necessarily an error, it is a state of the battery (a BMS on the other hand could report errors and that could be an ERROR
level diagnostic).
An example of ALERT
might be usage of an emergency stop button. It’s usage is not necessarily an error, but as it is related to safety we need to report it at the highest level possible.
Regardless of specific states, I think more granularity could be helpful.
19 posts - 11 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: New Packages for Jazzy Jalisco 2025-02-10
Hello there everyone!
We’re happy to announce 25 new packages (including rmw_zenoh
) and 216 updates are now available in ROS 2 Jazzy Jalisco
.
This sync was tagged as jazzy/2025-02-10 .
Package Updates for jazzy
Note that package counts include dbgsym packages which have been filtered out from the list below
Added Packages [25]:
- ros-jazzy-autoware-internal-planning-msgs: 1.5.0-2
- ros-jazzy-clearpath-config-live: 2.0.0-1
- ros-jazzy-clearpath-desktop: 2.0.0-1
- ros-jazzy-clearpath-nav2-demos: 2.0.0-1
- ros-jazzy-clearpath-offboard-sensors: 2.0.0-1
- ros-jazzy-clearpath-viz: 2.0.0-1
- ros-jazzy-cob-actions: 2.8.12-1
- ros-jazzy-cob-msgs: 2.8.12-1
- ros-jazzy-cob-srvs: 2.8.12-1
- ros-jazzy-crane-plus: 3.0.0-1
- ros-jazzy-crane-plus-control: 3.0.0-1
- ros-jazzy-crane-plus-description: 3.0.0-1
- ros-jazzy-crane-plus-examples: 3.0.0-1
- ros-jazzy-crane-plus-gazebo: 3.0.0-1
- ros-jazzy-crane-plus-moveit-config: 3.0.0-1
- ros-jazzy-kompass: 0.2.1-1
- ros-jazzy-kompass-interfaces: 0.2.1-1
- ros-jazzy-py-trees-ros-tutorials: 2.3.0-1
Updated Packages [216]:
- ros-jazzy-ackermann-steering-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-admittance-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-automatika-ros-sugar: 0.2.5-1 → 0.2.6-1
- ros-jazzy-autoware-internal-debug-msgs: 1.3.0-1 → 1.5.0-2
- ros-jazzy-autoware-internal-msgs: 1.3.0-1 → 1.5.0-2
- ros-jazzy-autoware-internal-perception-msgs: 1.3.0-1 → 1.5.0-2
- ros-jazzy-backward-ros: 1.0.6-1 → 1.0.7-1
- ros-jazzy-bicycle-steering-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-bond: 4.1.0-1 → 4.1.2-1
- ros-jazzy-bond-core: 4.1.0-1 → 4.1.2-1
- ros-jazzy-bondcpp: 4.1.0-1 → 4.1.2-1
- ros-jazzy-bondpy: 4.1.0-1 → 4.1.2-1
- ros-jazzy-clearpath-bt-joy: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-common: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-config: 2.0.1-1 → 2.1.0-1
- ros-jazzy-clearpath-control: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-customization: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-description: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-generator-common: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-manipulators: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-manipulators-description: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-motor-msgs: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-mounts-description: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-msgs: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-platform-description: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-platform-msgs: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-ros2-socketcan-interface: 2.0.0-1 → 2.1.0-1
- ros-jazzy-clearpath-sensors-description: 2.0.0-1 → 2.1.0-1
- ros-jazzy-control-toolbox: 3.5.0-1 → 4.0.0-1
- ros-jazzy-controller-interface: 4.24.0-1 → 4.25.0-1
- ros-jazzy-controller-manager: 4.24.0-1 → 4.25.0-1
- ros-jazzy-controller-manager-msgs: 4.24.0-1 → 4.25.0-1
- ros-jazzy-diff-drive-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-effort-controllers: 4.19.0-1 → 4.20.0-1
- ros-jazzy-eigen-stl-containers: 1.0.0-7 → 1.1.0-1
- ros-jazzy-force-torque-sensor-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-jazzy-forward-command-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-foxglove-bridge: 0.8.2-1 → 0.8.3-1
- ros-jazzy-geometric-shapes: 2.3.1-1 → 2.3.2-1
- ros-jazzy-gpio-controllers: 4.19.0-1 → 4.20.0-1
- ros-jazzy-grid-map: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-cmake-helpers: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-core: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-costmap-2d: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-cv: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-demos: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-filters: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-loader: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-msgs: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-octomap: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-pcl: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-ros: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-rviz-plugin: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-sdf: 2.2.0-1 → 2.2.1-1
- ros-jazzy-grid-map-visualization: 2.2.0-1 → 2.2.1-1
- ros-jazzy-gripper-controllers: 4.19.0-1 → 4.20.0-1
- ros-jazzy-hardware-interface: 4.24.0-1 → 4.25.0-1
- ros-jazzy-hardware-interface-testing: 4.24.0-1 → 4.25.0-1
- ros-jazzy-imu-sensor-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-jazzy-joint-limits: 4.24.0-1 → 4.25.0-1
- ros-jazzy-joint-state-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-jazzy-joint-trajectory-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-kitti-metrics-eval: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mapviz: 2.4.4-1 → 2.4.5-1
- ros-jazzy-mapviz-interfaces: 2.4.4-1 → 2.4.5-1
- ros-jazzy-mapviz-plugins: 2.4.4-1 → 2.4.5-1
- ros-jazzy-mecanum-drive-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-mola: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-bridge-ros2: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-demos: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-input-euroc-dataset: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-input-kitti-dataset: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-input-kitti360-dataset: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-input-mulran-dataset: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-input-paris-luco-dataset: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-input-rawlog: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-input-rosbag2: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-kernel: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-launcher: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-lidar-odometry: 0.5.4-1 → 0.6.1-1
- ros-jazzy-mola-metric-maps: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-msgs: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-pose-list: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-relocalization: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-traj-tools: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-viz: 1.5.1-1 → 1.6.0-1
- ros-jazzy-mola-yaml: 1.5.1-1 → 1.6.0-1
- ros-jazzy-moveit-visual-tools: 4.1.1-1 → 4.1.2-1
- ros-jazzy-mp2p-icp: 1.6.4-1 → 1.6.5-1
- ros-jazzy-multires-image: 2.4.4-1 → 2.4.5-1
- ros-jazzy-mvsim: 0.13.0-1 → 0.13.1-1
- ros-jazzy-odom-to-tf-ros2: 1.0.4-1 → 1.0.5-1
- ros-jazzy-pal-statistics: 2.6.0-1 → 2.6.1-1
- ros-jazzy-pal-statistics-msgs: 2.6.0-1 → 2.6.1-1
- ros-jazzy-parallel-gripper-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-pid-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-pose-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-jazzy-position-controllers: 4.19.0-1 → 4.20.0-1
- ros-jazzy-range-sensor-broadcaster: 4.19.0-1 → 4.20.0-1
- ros-jazzy-realtime-tools: 3.1.0-1 → 3.3.0-1
- ros-jazzy-rmw-zenoh-cpp: 0.2.0-1 → 0.2.1-1
- ros-jazzy-ros2-control: 4.24.0-1 → 4.25.0-1
- ros-jazzy-ros2-control-test-assets: 4.24.0-1 → 4.25.0-1
- ros-jazzy-ros2-controllers: 4.19.0-1 → 4.20.0-1
- ros-jazzy-ros2-controllers-test-nodes: 4.19.0-1 → 4.20.0-1
- ros-jazzy-ros2controlcli: 4.24.0-1 → 4.25.0-1
- ros-jazzy-rqt-controller-manager: 4.24.0-1 → 4.25.0-1
- ros-jazzy-rqt-joint-trajectory-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-smclib: 4.1.0-1 → 4.1.2-1
- ros-jazzy-srdfdom: 2.0.5-1 → 2.0.7-1
- ros-jazzy-steering-controllers-library: 4.19.0-1 → 4.20.0-1
- ros-jazzy-tile-map: 2.4.4-1 → 2.4.5-1
- ros-jazzy-transmission-interface: 4.24.0-1 → 4.25.0-1
- ros-jazzy-tricycle-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-tricycle-steering-controller: 4.19.0-1 → 4.20.0-1
- ros-jazzy-ur: 3.0.1-1 → 3.0.2-1
- ros-jazzy-ur-calibration: 3.0.1-1 → 3.0.2-1
- ros-jazzy-ur-client-library: 1.5.0-1 → 1.6.0-1
- ros-jazzy-ur-controllers: 3.0.1-1 → 3.0.2-1
- ros-jazzy-ur-dashboard-msgs: 3.0.1-1 → 3.0.2-1
- ros-jazzy-ur-description: 3.0.0-1 → 3.0.1-1
- ros-jazzy-ur-moveit-config: 3.0.1-1 → 3.0.2-1
- ros-jazzy-ur-robot-driver: 3.0.1-1 → 3.0.2-1
- ros-jazzy-velocity-controllers: 4.19.0-1 → 4.20.0-1
- ros-jazzy-zenoh-cpp-vendor: 0.2.0-1 → 0.2.1-1
Removed Packages [0]:
Thanks to all ROS maintainers who make packages available to the ROS community. The above list of packages was made possible by the work of the following maintainers:
- Automatika Robotics
- Bence Magyar
- Berkay Karaman
- Chris Iverach-Brereton
- Chris Lalancette
- Daniel Stonier
- Dave Coleman
- Felix Exner
- Felix Messmer
- Geoffrey Biggs
- George Stavrinos
- Hans-Joachim Krauch
- Jordan Palacios
- Jose Luis Blanco-Claraco
- Luis Camero
- M. Fatih Cırıt
- Maximilian Wulf
- MoveIt Release Team
- RT Corporation
- Roni Kreinin
- Ryohsuke Mitsudome
- Southwest Research Institute
- Tony Baltovski
- Tyler Weaver
- Victor López
- Yadunund
- Yukihiro Saito
Enjoy!
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: ROS News for the Week of February 3rd, 2025
ROS News for the Week of February 3rd, 2025
I am happy to announce that we have firm dates for ROSCon 2025 in Singapore
data:image/s3,"s3://crabby-images/6ba6b/6ba6bebf235e29af5d91549d749fec6302e7dbde" alt=":singapore: :singapore:"
ROSCon 2025 will be held on 2025-10-26T16:00:00Z UTC→2025-10-28T16:00:00Z UTC. We should have the website up by the end of the month.
data:image/s3,"s3://crabby-images/20b1c/20b1c47ae24239f1ef1136da32bce0d264a3d9a8" alt=":headstone: :headstone:"
Space ROS Jazzy 2025.01.0 has been released!
We get a lot of questions about multi-robot systems in the Discord. I came across this fantastic open-source project out of Polytechnique Montreal called, “A Multi-Robot Exploration Planner for Space Applications” that is a great guide to building your first multi-robot system.
Events
- 2025-02-07 Bracket Bot Hackathon
- 2025-02-12 Embodied AI Community Group #4
- 2025-02-11 Zenoh Advanced Features Workshop w/ Zettascale – Calendar Invite
- 2025-02-22 Pan-African Robotics Competition Deadline
- 2025-02-27 Zürich Robotics Meetup
- 2025-03-11 ==> 2025-03-13 ROS-Industrial Training (Americas) March 2025
- 2025-05-18 Maritime Community Group Meeting Feb 2025: Mecatron UnitySim for underwater robotics
- 2025-04-28 International Workshop on Robotics Software Engineering
- 2025-05-23 ICRA 2025 Advancing Quantitative and QUAlitative SIMulators for marine applications
- 2025-05-30 => 2025-05-31 2025 Open Hardware Summit in Edinburgh
- 2025-10-27 => 2025-10-29 ROSCon 2025 in Singapore – ROS Calendar Link
News
- Gazebo Classic Reaches End of Life
- Google Summer of Code - Call for Mentors
New TGC Members elected for 2025
- OSRA TGC meeting minutes for December, 2024
- Bonsai Robotics Raises $15 Million to Help Combat Farm Labor Shortage – The Robot Report
- Open-RMF: Community Forum
- ROS 2 Rust Meeting: February 2025
- Physical Intelligence open-sources Pi0 robotics foundation model
- Nauticus working with Leidos on underwater robots
- Teradyne robotics group lays off 10% of global staff
- Meta is studying how humans and robots can collaborate on housework
- SoCal Edison Tests REFCL Tech to Prevent LA Wildfires
- Indiegogo: Self-Driving Golf Trolley using ROS 2
- ELEGNT: Expressive and Functional Movement Design for Non-Anthropomorphic Robot
- A Roboticist Visits FOSDEM 2025
- IEEE ICRA 2025 Registration Now Open
ROS
Gazebo Classic 11 has reached end-of-life
Upcoming switch of Windows installation to pixi/conda
- Space ROS Jazzy 2025.01.0 Release
- ROS 2 Cheat Sheet
- py_trees_parser
- New packages for ROS 2 Rolling Ridley 2025-01-02
- ROS 2 launch GUI
- AutoAPMS: A unified software framework for creating behavior-based robotic applications
- The ros2_utils_tool, a full GUI toolkit for various ROS2 utilities with additional CLI support
- Vision-Only Robot Navigation in a Neural Radiance World
- Real-time Object Detection with NanoOWL on Jetson Orin Nano Super Devices
- Intrepid AI - All-in-one platform for autonomous robots
- ROS 2 Package to calculate the intrinsic and extrinsic camera calibration. Adding an easy way to fuse camera and lidars
- OpenCV: How To Participate in Intrinsic Bin Picking Challenge
- New Feature: Gazebo Visualize a Frustum
- Open Source at Physical-Intelligence
Articulated Robotics: How to make custom Gazebo worlds for your robot
- Hackaday: Stepper Motor Operating Principle And Microstepping Explained
A Python Library for Procedural Scene Generation in Robot Manipulation
- ToddlerBot: Open-Source ML-Compatible Humanoid Platform for Loco-Manipulation
- Palletizing ROS Robot
- Autonomous Mobile Robot simulation with Gazebo Fortress
- A Python library to facilitate interaction with Onshape’s REST API
- A flexible framework for accurate LiDAR odometry, map manipulation, and localization
- Insight: a minimalist GUI alternative to rqt
A Multi-Robot Exploration Planner for Space Applications
- VLM-Vac Enhancing Smart Vacuums via VLM Knowledge Distillation and Language Guided Experience Replay – paper
Got a Minute data:image/s3,"s3://crabby-images/f163d/f163de6b4e50eee44073e7a96028c3ec0a29dc61" alt=":mantelpiece_clock: :mantelpiece_clock:"
Want to become a ROS contributor? The ROS 2 CLI is a great place to start! Consider taking up an issue or adding a feature.
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: Open-RMF: Community Forum
I’m excited to announce the beginning of Open-RMF Community Forum sessions!
- Zoom Meeting Link
- 2025-02-10T08:00:00Z UTC
- See official OSRF events calendar for the biweekly scheduled events.
Community Forum sessions are an opportunity for members of the Open-RMF community to have open discussions with the project lead about matters pertaining to the project.
While the PMC sessions are driven by the project management committee members, these Community Forums are meant to be driven by community members. That includes users, contributors, and collaborators of Open-RMF, as well as anyone who is interested in the project and wanting to learn more about it.
Come to ask questions, share ideas, seek help, request features, or recommend designs.
PMC members are not obligated to attend, but the Open-RMF Project Lead will be present for every session. Individual sessions might be cancelled without advance notice but will be deleted from the calendar when that occurs.
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: Next Client Library WG Meeting: Friday 7th February 8AM PST
Hi,
The client library WG meeting is back this week.
The next meeting of the Client Library Working Group will be this Friday, thth February 2025 at 8 AM Pacific Time.
- Meeting link: https://meet.google.com/oij-atzj-znw
- Meeting minutes and agenda: ROS 2 Client Libraries Working Group - Google Docs
- Calendar invite: https://calendar.app.google/Rgc5GKdq9d6TGSZ3A
- Google group if you want to be notified of future meetings: https://groups.google.com/g/ros-2-client-library-wg
There’s a topic on the agenda from @emersonknapp, and we will likely discuss about ROS executors as usual.
Everyone is welcome to join and bring their own topics for discussion!
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: ROS Deliberation Community Group Meeting Minutes Feb 3 2025
Hi
This Monday, we had another successful meeting of the ROS Deliberation Community Group, thanks to the amazing preparation by @scastro. Thanks for that and everyone who participated. We had great discussions primarily on the two topics of
- Unified Planning and
- task-level learning for deliberation
Find the full minutes here: ROS Deliberation Community Group - Google Docs
Call for contributions
We are looking for quick technical spotlights on your favourite deliberation tools. It does not have to more than 5 minutes. Please get in touch if you want to share your work or your experiences with existing tools.
You are in any case very welcome to participate in future meetings. You can find all necessary information in the document linked above.
Looking forward to discussing deliberation technologies in ROS with you soon.
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: Cloud Robotics WG Meeting 2025-02-10 | Trying KubeEdge (For Real This Time)
Please come and join us for this coming meeting at 1700-1800 UTC on Monday 10th February 2025, where we will locate and work through some KubeEdge examples. We will note down our feedback and provide it to Tomoya Fujita, who gave a talk in a previous session about KubeEdge and some related technologies. If you’re interested to see the talk, we have published it on YouTube.
This was also the original plan from last meeting, but unfortunately we did not have the prerequisites set up; the coming meeting will have the prerequisites ready to try KubeEdge out, For Real This Time. If you are interested to see the previous meeting, the recording is available on YouTube.
If you are willing and able to give a talk on cloud robotics in future meetings, we would be happy to host you - please reply here, message me directly, or sign up using the Guest Speaker Signup Sheet. We will record your talk and host it on YouTube with our other meeting recordings too!
The meeting link is here, and you can sign up to our calendar or our Google Group for meeting notifications or keep an eye on the Cloud Robotics Hub.
Hopefully we will see you there!
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: New packages for ROS 2 Rolling Ridley 2025-02-04
Hello everyone!
We’re happy to announce 16 new package and 211 updates are now available in ROS 2 Rolling Ridley
While 18 packages were removed, they will be re-added once build fixes are applied and bloomed.
This sync was tagged as rolling/2025-02-04
.
Package Updates for rolling
Added Packages [16]:
- ros-rolling-autoware-internal-planning-msgs: 1.5.0-1
- ros-rolling-autoware-internal-planning-msgs-dbgsym: 1.5.0-1
- ros-rolling-cob-actions: 2.8.12-1
- ros-rolling-cob-actions-dbgsym: 2.8.12-1
- ros-rolling-cob-msgs: 2.8.12-1
- ros-rolling-cob-msgs-dbgsym: 2.8.12-1
- ros-rolling-cob-srvs: 2.8.12-1
- ros-rolling-cob-srvs-dbgsym: 2.8.12-1
- ros-rolling-gz-ros2-control: 2.0.5-1
- ros-rolling-gz-ros2-control-dbgsym: 2.0.5-1
- ros-rolling-gz-ros2-control-demos: 2.0.5-1
- ros-rolling-gz-ros2-control-demos-dbgsym: 2.0.5-1
- ros-rolling-kompass: 0.2.1-1
- ros-rolling-kompass-interfaces: 0.2.1-1
- ros-rolling-kompass-interfaces-dbgsym: 0.2.1-1
- ros-rolling-py-trees-ros-tutorials: 2.3.0-1
Updated Packages [211]:
- ros-rolling-ament-clang-format: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-clang-tidy: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-clang-format: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-clang-tidy: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-copyright: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-cppcheck: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-cpplint: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-flake8: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-lint-cmake: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-mypy: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-pclint: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-pep257: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-pycodestyle: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-pyflakes: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-uncrustify: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cmake-xmllint: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-copyright: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cppcheck: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-cpplint: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-flake8: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-lint: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-lint-auto: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-lint-cmake: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-lint-common: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-mypy: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-pclint: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-pep257: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-pycodestyle: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-pyflakes: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-uncrustify: 0.19.0-1 → 0.19.1-1
- ros-rolling-ament-xmllint: 0.19.0-1 → 0.19.1-1
- ros-rolling-automatika-ros-sugar: 0.2.5-1 → 0.2.6-1
- ros-rolling-automatika-ros-sugar-dbgsym: 0.2.5-1 → 0.2.6-1
- ros-rolling-autoware-internal-debug-msgs: 1.3.0-1 → 1.5.0-1
- ros-rolling-autoware-internal-debug-msgs-dbgsym: 1.3.0-1 → 1.5.0-1
- ros-rolling-autoware-internal-msgs: 1.3.0-1 → 1.5.0-1
- ros-rolling-autoware-internal-msgs-dbgsym: 1.3.0-1 → 1.5.0-1
- ros-rolling-autoware-internal-perception-msgs: 1.3.0-1 → 1.5.0-1
- ros-rolling-autoware-internal-perception-msgs-dbgsym: 1.3.0-1 → 1.5.0-1
- ros-rolling-bond: 4.1.0-1 → 4.1.2-1
- ros-rolling-bond-core: 4.1.0-1 → 4.1.2-1
- ros-rolling-bond-dbgsym: 4.1.0-1 → 4.1.2-1
- ros-rolling-bondcpp: 4.1.0-1 → 4.1.2-1
- ros-rolling-bondcpp-dbgsym: 4.1.0-1 → 4.1.2-1
- ros-rolling-bondpy: 4.1.0-1 → 4.1.2-1
- ros-rolling-eigen-stl-containers: 1.0.0-6 → 1.1.0-1
- ros-rolling-geometric-shapes: 2.3.1-1 → 2.3.2-1
- ros-rolling-geometric-shapes-dbgsym: 2.3.1-1 → 2.3.2-1
- ros-rolling-gz-rendering-vendor: 0.2.0-1 → 0.2.1-1
- ros-rolling-gz-rendering-vendor-dbgsym: 0.2.0-1 → 0.2.1-1
- ros-rolling-kitti-metrics-eval: 1.5.1-1 → 1.6.0-1
- ros-rolling-kitti-metrics-eval-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-liblz4-vendor: 0.29.0-1 → 0.31.0-1
- ros-rolling-mapviz: 2.4.4-1 → 2.4.5-1
- ros-rolling-mapviz-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-rolling-mapviz-interfaces: 2.4.4-1 → 2.4.5-1
- ros-rolling-mapviz-interfaces-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-rolling-mapviz-plugins: 2.4.4-1 → 2.4.5-1
- ros-rolling-mapviz-plugins-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-rolling-mcap-vendor: 0.29.0-1 → 0.31.0-1
- ros-rolling-mcap-vendor-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-mola: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-bridge-ros2: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-bridge-ros2-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-demos: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-euroc-dataset: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-euroc-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-kitti-dataset: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-kitti-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-kitti360-dataset: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-kitti360-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-mulran-dataset: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-mulran-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-paris-luco-dataset: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-paris-luco-dataset-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-rawlog: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-rawlog-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-rosbag2: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-input-rosbag2-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-kernel: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-kernel-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-launcher: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-launcher-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-lidar-odometry: 0.5.4-1 → 0.6.1-1
- ros-rolling-mola-lidar-odometry-dbgsym: 0.5.4-1 → 0.6.1-1
- ros-rolling-mola-metric-maps: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-metric-maps-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-msgs: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-msgs-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-pose-list: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-pose-list-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-relocalization: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-relocalization-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-traj-tools: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-traj-tools-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-viz: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-viz-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-yaml: 1.5.1-1 → 1.6.0-1
- ros-rolling-mola-yaml-dbgsym: 1.5.1-1 → 1.6.0-1
- ros-rolling-mp2p-icp: 1.6.4-1 → 1.6.5-1
- ros-rolling-mp2p-icp-dbgsym: 1.6.4-1 → 1.6.5-1
- ros-rolling-multires-image: 2.4.4-1 → 2.4.5-1
- ros-rolling-multires-image-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-rolling-odom-to-tf-ros2: 1.0.4-1 → 1.0.5-2
- ros-rolling-odom-to-tf-ros2-dbgsym: 1.0.4-1 → 1.0.5-2
- ros-rolling-rcl: 10.0.1-1 → 10.0.2-1
- ros-rolling-rcl-action: 10.0.1-1 → 10.0.2-1
- ros-rolling-rcl-action-dbgsym: 10.0.1-1 → 10.0.2-1
- ros-rolling-rcl-dbgsym: 10.0.1-1 → 10.0.2-1
- ros-rolling-rcl-lifecycle: 10.0.1-1 → 10.0.2-1
- ros-rolling-rcl-lifecycle-dbgsym: 10.0.1-1 → 10.0.2-1
- ros-rolling-rcl-yaml-param-parser: 10.0.1-1 → 10.0.2-1
- ros-rolling-rcl-yaml-param-parser-dbgsym: 10.0.1-1 → 10.0.2-1
- ros-rolling-rclpy: 8.0.0-1 → 9.0.0-1
- ros-rolling-rcpputils: 2.13.2-1 → 2.13.3-1
- ros-rolling-rcpputils-dbgsym: 2.13.2-1 → 2.13.3-1
- ros-rolling-rcutils: 6.9.3-1 → 6.9.4-1
- ros-rolling-rcutils-dbgsym: 6.9.3-1 → 6.9.4-1
- ros-rolling-realtime-tools: 3.1.0-1 → 4.0.0-1
- ros-rolling-realtime-tools-dbgsym: 3.1.0-1 → 4.0.0-1
- ros-rolling-rmw: 7.5.1-1 → 7.6.0-1
- ros-rolling-rmw-dbgsym: 7.5.1-1 → 7.6.0-1
- ros-rolling-rmw-implementation-cmake: 7.5.1-1 → 7.6.0-1
- ros-rolling-ros2action: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2bag: 0.29.0-1 → 0.31.0-1
- ros-rolling-ros2cli: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2cli-test-interfaces: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2cli-test-interfaces-dbgsym: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2component: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2doctor: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2interface: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2lifecycle: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2lifecycle-test-fixtures: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2lifecycle-test-fixtures-dbgsym: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2multicast: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2node: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2param: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2pkg: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2run: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2service: 0.36.1-1 → 0.37.0-1
- ros-rolling-ros2topic: 0.36.1-1 → 0.37.0-1
- ros-rolling-rosbag2: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-compression: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-compression-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-compression-zstd: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-compression-zstd-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-cpp: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-cpp-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-examples-cpp: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-examples-cpp-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-examples-py: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-interfaces: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-interfaces-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-performance-benchmarking: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-performance-benchmarking-msgs: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-py: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-storage: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-storage-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-storage-default-plugins: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-storage-mcap: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-storage-mcap-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-storage-sqlite3: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-storage-sqlite3-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-test-common: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-test-msgdefs: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-test-msgdefs-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-tests: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-transport: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosbag2-transport-dbgsym: 0.29.0-1 → 0.31.0-1
- ros-rolling-rosidl-typesupport-c: 3.3.1-1 → 3.3.2-1
- ros-rolling-rosidl-typesupport-c-dbgsym: 3.3.1-1 → 3.3.2-1
- ros-rolling-rosidl-typesupport-cpp: 3.3.1-1 → 3.3.2-1
- ros-rolling-rosidl-typesupport-cpp-dbgsym: 3.3.1-1 → 3.3.2-1
- ros-rolling-rqt: 1.8.0-1 → 1.9.0-1
- ros-rolling-rqt-graph: 1.6.1-1 → 1.7.0-1
- ros-rolling-rqt-gui: 1.8.0-1 → 1.9.0-1
- ros-rolling-rqt-gui-cpp: 1.8.0-1 → 1.9.0-1
- ros-rolling-rqt-gui-cpp-dbgsym: 1.8.0-1 → 1.9.0-1
- ros-rolling-rqt-gui-py: 1.8.0-1 → 1.9.0-1
- ros-rolling-rqt-py-common: 1.8.0-1 → 1.9.0-1
- ros-rolling-rqt-py-console: 1.3.0-1 → 1.4.0-1
- ros-rolling-rqt-service-caller: 1.3.0-1 → 1.4.0-1
- ros-rolling-rviz-assimp-vendor: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-common: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-common-dbgsym: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-default-plugins: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-default-plugins-dbgsym: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-ogre-vendor: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-ogre-vendor-dbgsym: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-rendering: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-rendering-dbgsym: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-rendering-tests: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz-visual-testing-framework: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz2: 14.4.1-1 → 14.4.2-1
- ros-rolling-rviz2-dbgsym: 14.4.1-1 → 14.4.2-1
- ros-rolling-smclib: 4.1.0-1 → 4.1.2-1
- ros-rolling-sqlite3-vendor: 0.29.0-1 → 0.31.0-1
- ros-rolling-tile-map: 2.4.4-1 → 2.4.5-1
- ros-rolling-tile-map-dbgsym: 2.4.4-1 → 2.4.5-1
- ros-rolling-ur-calibration: 3.0.1-1 → 3.0.2-1
- ros-rolling-ur-calibration-dbgsym: 3.0.1-1 → 3.0.2-1
- ros-rolling-ur-client-library: 1.5.0-1 → 1.6.0-1
- ros-rolling-ur-client-library-dbgsym: 1.5.0-1 → 1.6.0-1
- ros-rolling-ur-controllers: 3.0.1-1 → 3.0.2-1
- ros-rolling-ur-controllers-dbgsym: 3.0.1-1 → 3.0.2-1
- ros-rolling-ur-dashboard-msgs: 3.0.1-1 → 3.0.2-1
- ros-rolling-ur-dashboard-msgs-dbgsym: 3.0.1-1 → 3.0.2-1
- ros-rolling-ur-description: 3.0.0-1 → 3.0.1-1
- ros-rolling-ur-robot-driver: 3.0.1-1 → 3.0.2-1
- ros-rolling-ur-robot-driver-dbgsym: 3.0.1-1 → 3.0.2-1
- ros-rolling-zstd-vendor: 0.29.0-1 → 0.31.0-1
Removed Packages [18]:
- ros-rolling-battery-state-broadcaster
- ros-rolling-battery-state-broadcaster-dbgsym
- ros-rolling-canopen-ros2-controllers
- ros-rolling-canopen-ros2-controllers-dbgsym
- ros-rolling-canopen-tests
- ros-rolling-kinova-gen3-6dof-robotiq-2f-85-moveit-config
- ros-rolling-kinova-gen3-7dof-robotiq-2f-85-moveit-config
- ros-rolling-kortex-description
- ros-rolling-moveit-servo
- ros-rolling-moveit-servo-dbgsym
- ros-rolling-performance-test
- ros-rolling-performance-test-dbgsym
- ros-rolling-picknik-reset-fault-controller
- ros-rolling-picknik-reset-fault-controller-dbgsym
- ros-rolling-picknik-twist-controller
- ros-rolling-picknik-twist-controller-dbgsym
- ros-rolling-ur
- ros-rolling-ur-moveit-config
Thanks to all ROS maintainers who make packages available to the ROS community. The above list of packages was made possible by the work of the following maintainers:
- Addisu Z. Taddese
- Alejandro Hernandez
- Alejandro Hernandez Cordero
- Alejandro Hernández
- Audrow Nash
- Automatika Robotics
- Bence Magyar
- Berkay Karaman
- Brandon Ong
- Chris Lalancette
- Daniel Stonier
- Dharini Dutia
- Felix Exner
- Felix Messmer
- Foxglove
- Geoffrey Biggs
- George Stavrinos
- Jose Luis Blanco-Claraco
- Jose-Luis Blanco-Claraco
- M. Fatih Cırıt
- Michael Orlov
- ROS Tooling Working Group
- Ryohsuke Mitsudome
- Shane Loretz
- Southwest Research Institute
- Tyler Weaver
- Yukihiro Saito
- geoff
2 posts - 2 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: :checkered_flag: Gazebo Classic 11 has reached end-of-life [x-post Gazebo Sim Community]
Dear ROS Community,
It is bittersweet to announce that Gazebo Classic (Gazebo11) has reached end-of-life (EOL). It was released in January, 2020 and was a Long Term Supported (LTS) release with support lasting 5 years. This is a significant EOL in that, going forward only versions of modern Gazebo will be supported by the Gazebo team. As of today all versions of Gazebo Classic, denoted by numbered release names, are end of life. We recommend that users upgrade to Gazebo Harmonic or Gazebo Fortress as soon as reasonably possible.
Gazebo Classic introduced many exciting features, including SDFormat 1.7 frame semantics, Support for BVH skeletal animations, Slow motion / sped up log playback, and Tracked vehicles with flippers to name a few. See the entire list of features on the release blog post and on the source changelog.
What does End of Life Mean?
Users often ask us, “what does end of life mean?” To put it briefly, end of life means that the Gazebo team will no longer support that particular Gazebo release. In practical terms, this means that we will no longer be providing the following for Gazebo Classic:
- New features or capabilities
- Security updates
- Bug fixes, patches or support
- Updated binaries
It is also worth noting the things that won’t change after Gazebo Classic goes end of life:
- Gazebo Classic binaries will not suddenly disappear
- Users will not need to migrate immediately, but they should migrate as soon as possible
Why do we End of Life Gazebo releases?
We End of Life particular Gazebo releases for the same reason that most people don’t use Windows XP or an iPhone 4 anymore: better versions of the software are now available and we simply don’t have the resources to support every Gazebo release into perpetuity. Marking a particular version of Gazebo end of life frees up resources to help support newer and better versions of the software. More to the point, the underlying packages and operating system (Ubuntu Focal) used by Gazebo Classic also goes end of life in April 2025.
How do I upgrade to a newer version of Gazebo and which one should I use?
We recommend that Gazebo Classic users upgrade to the latest long term support release of modern Gazebo, Gazebo Harmonic. Gazebo Harmonic works best on Ubuntu Jammy (22.04) and Ubuntu Noble (24.04) and will be supported until September of 2028. Gazebo Classic users who still use ROS 1 will also need to upgrade to ROS 2 Jazzy to use Gazebo Harmonic. It is worth noting that all of ROS 1, including ROS 1 Noetic, will go end of life on May 23rd, 2025. Our internal estimates indicate that over 80% of the ROS community has already upgraded to ROS 2, and 67% of Gazebo users have already upgraded to modern Gazebo.
The modern Gazebo documentation includes a variety of guides and tutorials on how to migrate your project from Gazebo Classic to modern Gazebo. Similarly, the ROS 2 documentation provides step by step instructions on how to migrate your ROS 1 project to ROS 2. If you get stuck during migration, we would encourage you to use the Open Robotics Discord, the Gazebo Sim Community, and Robotics Stack Exchange to find help.
Help Spread the Word
We realize that many Gazebo Classic users don’t really track Gazebo end of life dates, or regularly visit Gazebosim Community, that’s why we’ve decided to include some notifications about Gazebo Classic’s end of life in our latest update. After updating to the latest release, Gazebo Classic users will be notified via debug output and a banner of end of life status. These warnings can be suppressed by simply setting a “GAZEBO_SUPPRESS_EOL_WARNING” environment variable.
We would appreciate the community’s help in spreading the word about the Gazebo Classic End of Life. If you work on a team that is still using Gazebo Classic please take a moment in the next week or two to discuss upgrade paths with your team and the importance of upgrading as soon as possible.
Supporting Libraries Reaching EOL
As part of the Gazebo Classic EOL, the following Gazebo libraries have also reached end-of-life. Their latest released binaries will remain available at http://packages.osrfoundation.org/, but no more fixes or releases will be made.
Library major version | Final release |
---|---|
gz-common3 (ignition-common3) | 3.17.1 |
gz-fuel-tools4 (ignition-fuel-tools4) | 4.9.2 |
gz-msgs5 (ignition-msgs5) | 5.11.1 |
gz-transport8 (ignition-transport8) | 8.5.1 |
libsdformat9 | 9.10.2 |
Gazebo11 (Gazebo Classic) | 11.15.1 |
We sincerely thank everyone in the community that has contributed to Gazebo Classic
Gazebo Dev Team
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: Interop SIG February 6, 2025: Customize and configure the rmf-web dashboard with MicroApps
2025-02-06T15:00:00Z UTC
This month Aaron Chong will present on how to leverage the new MicroApp architecture of rmf-web to make custom dashboards for fleet management.
MicroApps are React components used to customize the rmf-web dashboard. This talk will go through what MicroApps are, how they can be built, and how to integrate them with an existing rmf-web dashboard. We will also go through some of the MicroApps that already come with the rmf-dashboard-framework, and how they interact with an Open-RMF deployment.
2 posts - 2 participants
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)
ROS Discourse General: New TGC Members elected for 2025
The OSRA’s Technical Governance Committee has begun 2025 with the election of several new members to represent various different parts of the OSRA and to rebalance it after the growth in OSRA members during 2024. The new membership of the TGC is:
- Addisu Taddese, Intrinsic (Gazebo Project Leader)
- Clara Berendsen, Ekumen (Infrastructure Project Representative)
- Daniel Gordon, Huawei (Gold Representative)
- David Lu!! (Supporting Individual Representative)
- Geoffrey Biggs, OSRF (TGC Chair)
- Hemal Shah, NVIDIA (Platinum Member Representative)
- Henkel Christian, Bosch (Gold Representative)
- Kat Scott, Intrinsic (Developer Relations Representative)
- Maria Carolina Vergo, ROS-Industrial (Silver Representative)
- Michael Carrol, Intrinsic (Interim ROS Project Leader)
- Michael Grey, Intrinsic (Open-RMF Project Leader)
- Michel Hidalgo, Ekumen (Silver Representative)
- Sathish Mani, Qualcomm Technologies (Platinum Member Representative)
- Steve Peters, Intrinsic (Gazebo Project Representative)
- Steven! Ragnarok, Intrinsic (Infrastructure Project Leader)
- Tully Foote, Intrinsic (Platinum Member Representative)
- Vanessa Yamzon Orsi, OSRF (Secretary)
- Vicky Brasseur (OSRA Open Governance Advisor)
- Yadunund Vijay, Intrinsic (Open-RMF Project Representative)
I’d like to thank all those who have volunteered their time to help guide the OSRA. I’d also like to thank those members who stepped down recently for contributing to the TGC’s first 8 months of operation and helping to get the OSRA off to such a great start.
- Angelo Corsaro, Zettascale
- Christine Fraser, Asimovo
- Jason Higgins, Clearpath Robotics
- Andra Keay, Silicon Valley Robotics
- Chris Lalancette, Intrinsic
- Steve Macenski, Open Navigation
1 post - 1 participant
![[WWW] [WWW]](/moin_static197/rostheme/img/moin-www.png)