Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file
CONTRIBUTING
Repository Summary
| Checkout URI | https://github.com/MRPT/mrpt_ros_bridge.git |
| VCS Type | git |
| VCS Version | ros2 |
| Last Updated | 2025-10-25 |
| Dev Status | DEVELOPED |
| Released | UNRELEASED |
| Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Packages
| Name | Version |
|---|---|
| mrpt_libros_bridge | 2.14.15 |
| rosbag2rawlog | 2.14.15 |
README
mrpt_ros_bridge
ROS 2 package providing a C++ bridge between MRPT (Mobile Robot Programming Toolkit) and the ROS 2 ecosystem.
It enables seamless conversion between MRPT and ROS message types for maps, sensor data, poses, images, and more.
Build Farm Status
| Distro | Build dev | Stable sync |
|---|---|---|
| ROS 2 Humble (u22.04) | ||
| ROS 2 Jazzy (u24.04) | ||
| ROS 2 Kilted (u24.04) | ||
| ROS 2 Rolling (u24.04) |
Individual package build status
| Package | ROS 2 Humble BinBuild |
ROS 2 Jazzy BinBuild |
ROS 2 Kilted BinBuild |
ROS 2 Rolling BinBuild |
|---|---|---|---|---|
mrpt_libros_bridge |
||||
rosbag2rawlog |
Overview
The mrpt_libros_bridge library provides bidirectional converters between MRPT data structures and ROS 2 message types.
It simplifies integrating MRPT-based algorithms (e.g. SLAM, perception, mapping) with ROS 2 nodes.
Included packages
| Package | Description |
|---|---|
mrpt_libros_bridge |
Core C++ library bridging MRPT data types with ROS 2 messages (poses, maps, sensor data, etc.). |
rosbag2rawlog |
Command-line tool to convert ROS 2 .bag files into MRPT .rawlog datasets. |
Features
- Convert between MRPT and ROS 2 types:
-
geometry_msgs::Pose⇄mrpt::poses::CPose3D -
sensor_msgs::LaserScan⇄mrpt::obs::CObservation2DRangeScan -
sensor_msgs::Image⇄mrpt::img::CImage -
sensor_msgs::Imu,NavSatFix,PointCloud2, etc.
-
- Compatible with ROS 2 distros: Humble, Jazzy, Kilted, and Rolling.
- Written in C++17, using ament_cmake.
- Includes unit tests for conversions and message integrity.
Installing
Install from ROS build servers with:
sudo apt install ros-${ROS_DISTRO}-rosbag2rawlog ros-${ROS_DISTRO}-mrpt-ros-bridge
Building from sources
If needed to build from source code, do this:
# Source your ROS 2 environment
source /opt/ros/jazzy/setup.bash
# Clone dependencies
mkdir -p ~/ros2_ws/src
cd ~/ros2_ws/src
git clone https://github.com/MRPT/mrpt_ros_bridge.git
# Install dependencies
rosdep install --from-paths . --ignore-src -r -y
# Build
cd ~/ros2_ws
colcon build --symlink-install
Usage Example
1. Using the conversion library
#include <mrpt_libros_bridge/pose.h>
#include <geometry_msgs/msg/pose.hpp>
#include <mrpt/poses/CPose3D.h>
geometry_msgs::msg::Pose ros_pose;
mrpt::poses::CPose3D mrpt_pose(1.0, 2.0, 0.0, 0.0, 0.0, 1.57);
mrpt::ros2bridge::toROS(mrpt_pose, ros_pose);
File truncated at 100 lines see the full file