CHANGELOG

Changelog for package ros_gz_bridge

0.244.14 (2024-04-08)

  • Added conversion for Detection3D and Detection3DArray (#523) (#526) Co-authored-by: wittenator <9154515+wittenator@users.noreply.github.com>

  • Add ROS namespaces to GZ topics (#512) Co-authored-by: Alejandro Hernández Cordero <ahcorde@gmail.com>

  • Correctly export ros_gz_bridge for downstream targets (#503) (#506)

  • Add a virtual destructor to suppress compiler warning (#502) (#505) Co-authored-by: Michael Carroll <mjcarroll@intrinsic.ai>

  • Add option to change material color from ROS. (#486) * Message and bridge for MaterialColor. This allows bridging MaterialColor from ROS to GZ and is important for allowing simulation users to create status lights. ——— Co-authored-by: Alejandro Hernández Cordero <ahcorde@gmail.com> Co-authored-by: Addisu Z. Taddese <addisuzt@intrinsic.ai> Co-authored-by: Addisu Z. Taddese <addisu@openrobotics.org>

  • Contributors: Alejandro Hernández Cordero, Benjamin Perseghetti, Krzysztof Wojciechowski, Michael Carroll

0.244.13 (2024-01-23)

  • backport pr 374 (#489)

  • populate imu covariances when converting (#488)

  • Contributors: El Jawad Alaa

0.244.12 (2023-12-13)

  • Backport: Add conversion for geometry_msgs/msg/TwistStamped <-> gz.msgs.Twist (#468) (#470)

  • Add support for Harmonic/Humble pairing (#462)

  • Added messages for 2D Bounding Boxes to ros_gz_bridge (#458)

  • Fix double wait in ros_gz_bridge (#347) (#450)

  • [backport humble] SensorNoise msg bridging (#417)

  • [backport humble] Added Altimeter msg bridging (#413) (#414) (#426)

  • [backport humble] Update README.md (#411) The ROS type for gz.msgs.NavSat messages should be sensor_msgs/msg/NavSatFix instead of sensor_msgs/msg/NavSatFixed

  • Contributors: Addisu Z. Taddese, Alejandro Hernández Cordero, Arjun K Haridas, wittenator

0.244.11 (2023-05-23)

  • Add actuator_msgs to humble bridge. (#394)

  • Contributors: Benjamin Perseghetti

0.244.10 (2023-05-03)

  • Fix warning message (#371)

  • Introduce WrenchStamped into bridge (#327)

  • Humbly bringing the Joy to gazebo. (#353)

  • Make the bridge aware of both gz and ignition msgs (#349)

  • Contributors: Benjamin Perseghetti, El Jawad Alaa, Michael Carroll, livanov93

0.244.9 (2022-11-03)

0.244.8 (2022-10-28)

0.244.7 (2022-10-12)

  • Make sure that ign_* yaml configs work as well (#310)

  • Bridge between msgs::Float_V and ros_gz_interfaces/Float32Array msg types (#306) * bridge float_v and float32_multi_array msg type Co-authored-by: Ian Chen <ichen@openrobotics.org>

  • Bridge between msgs::Pose_V and geometry_msgs/PoseArray msg types (#305)

  • replace ign with gz in ros_gz_bridge README (#303)

  • Merge pull request #275 (Galactic to Humble) Galactic to Humble

  • Fix merge

  • Merge branch ‘ros2’ into ports/galactic_to_ros2

  • Contributors: Ian Chen, Michael Carroll, Olivier Kermorgant

0.244.6 (2022-09-14)

0.244.5 (2022-09-12)

  • Fix missing msgs include and packages.xml deps (#292) * Fix missing msgs include and packages.xml deps * Add additional conditions to support gz sim invocation * Fix cpplint

  • Add missing GZ_VERSION ticktocks (#289)

  • Support ros_ign migration (#282) Clean up shared libraries, and tick-tock RosGzPointCloud Tick-tock launch args Hard-tock ign_ in sources Migrate ign, ign_, IGN_ for sources, launch, and test files Migrate IGN_XXX_VER, IGN_T, header guards Migrate launchfile, launchfile args, and test source references Migrate ros_ign_XXX and gz_gazebo -> gz_sim Migrate ros_ign_XXX project names Migrate Ign, ign-, IGN_DEPS, ign-gazebo Migrate ignitionrobotics, ignitionrobotics/ros_ign, osrf/ros_ign Migrate ignition-version, IGNITION_VERSION, Ignition <LIB>, ros_ign_ci

  • Move packages and files to gz (#282)

  • Contributors: methylDragon

0.244.3 (2022-05-19)

  • Feature: set QoS options to override durability (#250) Co-authored-by: Louise Poubel <louise@openrobotics.org>

  • [ros2] README updates (service bridge, Gazebo rename) (#252)

  • Fix linter tests (#251) Co-authored-by: Louise Poubel <louise@openrobotics.org>

  • Adds pose and twist with covariance messages bridging (#222) * Added pose, twist and odometry with covariance messages bridging

  • Contributors: Aditya Pande, Daisuke Nishimatsu, Louise Poubel

0.244.2 (2022-04-25)

  • Support bridging services (#211)

  • Added reminder to hit play to receive images. (#237)

  • Updated ign topic commnds on README (#221)

  • Add conversions for ros_gz_interfaces/WorldControl and builtin_interfaces/Time (#216)

  • [ros_gz_interfaces] Add GuiCamera, StringVec, TrackVisual, VideoRecord (#214)

  • Break apart ros_subscriber test translation unit (#212)

  • Bring ros2 branch up-to-date with Rolling (#213)

  • Add missing dependency on rclcpp (#209)

  • Separate galactic branch from ros2 branch (#201)

  • 🏁 Dome EOL (#198)

  • Contributors: Aditya Pande, Ivan Santiago Paunovic, Joep Tool, Louise Poubel, Michael Carroll

0.244.1 (2022-01-04)

  • Improve modularity of ign/ros publisher tests (#194)

  • Contributors: Michael Carroll

0.244.0 (2021-12-30)

  • Default to Fortress for Rolling (future Humble) (#195)

  • [ros2] 🏁 Dome EOL (#199)

  • New Light Message, also bridge Color (#187)

  • Statically link each translation unit (#193)

  • Break apart convert and factories translation unit (#192)

  • Fixed ROS subscriber test in ros_gz_bridge (#189)

  • Enable QoS overrides (#181)

  • Fixed ros ign bridge documentation (#178)

  • Expose Contacts through ROS bridge (#175)

  • Contributors: Alejandro Hernández Cordero, Guillaume Doisy, Louise Poubel, Michael Carroll, Vatan Aksoy Tezer, William Lew

0.233.2 (2021-07-20)

  • [ros2] Update version docs, add Galactic and Fortress (#164)

  • Contributors: Louise Poubel

0.233.1 (2021-04-16)

  • Default to Edifice for Rolling (#150)

  • Ignore local publications for ROS 2 subscriber (#146) - Note: Does not work with all rmw implementations (e.g.: FastRTPS)

  • Update documentation for installation instructions and bridge examples (#142)

  • Edifice support (#140)

  • Add JointTrajectory message conversion (#121) Conversion between - ignition::msgs::JointTrajectory - trajectory_msgs::msg::JointTrajectory

  • Add TFMessage / Pose_V and Float64 / Double conversions (#117) Addresses issue #116

  • Updated prereq & branch name (#113)

  • Update releases (#108)

  • Updated README.md (#104)

  • Add support for Dome (#103)

  • Contributors: Alejandro Hernández Cordero, Andrej Orsula, Florent Audonnet, Jenn, Louise Poubel, Luca Della Vedova

0.221.1 (2020-08-19)

  • Add pkg-config as a buildtool dependency (#102)

  • Port ros_gz_bridge tests to ROS 2 (#98)

  • Rename test_utils.hpp (#98)

  • Contributors: Louise Poubel, ahcorde

0.221.0 (2020-07-23)

  • Install only what’s necessary, rename builtin_interfaces (#95)

  • Move headers to src, rename builtin_interfaces (#95)

  • Integer support (#91) Adds Int32 to the bridge.

  • [ros2] Fixed CI - Added Foxy (#89) Co-authored-by: Louise Poubel <louise@openrobotics.org>

  • Ignore ros-args in parameter bridge (#65)

  • Update Dashing docs (#62)

  • Update dependencies to Citadel (#57)

  • [WIP] Port ign_ros_gazebo_demos to ROS2 (#58) Port ros_gz_image to ROS2 Port ros_gz_sim_demos to ROS2

  • Add support for std_msgs/Empty (#53)

  • Add support for std_msgs/Bool (#50)

  • [ros2] Port ros_gz_bridge to ROS2 (#45)

  • Enable ROS2 CI for Dashing branch (#43)

  • Make all API and comments ROS-version agnostic

  • Rename packages and fix compilation + tests

  • Move files ros1 -> ros

  • Contributors: Addisu Taddese, Alejandro Hernández Cordero, Jose Luis Rivero, Louise Poubel, Luca Della Vedova, Michael Carroll, Mohamed Ahmed, Shivesh Khaitan, chapulina

0.7.0 (2019-08-15)

  • Merge pull request #38 from osrf/unidirectional Support unidirectional bridge topics

  • More examples

  • Merge pull request #37 from osrf/debug Adding debug and error statements

  • Switch to characters supported by ros

  • Merge branch ‘debug’ into unidirectional

  • More output, and rosconsole depend

  • Support specification of bridge direction

  • Adding debug and error statements

  • Contributors: Nate Koenig

0.6.3 (2019-08-04)

0.6.2 (2019-08-04)

0.6.1 (2019-08-04)

  • Update README.md

  • Contributors: Carlos Agüero

0.6.0 (2019-08-02)

  • Merge pull request #33 from osrf/issue_31 Fix issue #31

  • Image bridge using image_transport (#34) * Image bridge using image_transport * tests for image * correct metapackage * tests with catkin Signed-off-by: Louise Poubel <louise@openrobotics.org> * Revert changes from #32 Signed-off-by: Louise Poubel <louise@openrobotics.org>

  • Use intra-process field from messageInfo.

  • Contributors: Carlos Aguero, Nate Koenig, chapulina

  • 0.5.0

  • Battery state (#30)

  • Packed demo (#29) * adding demo for point cloud packed bridge * correct rviz file * RGBD bridged cloud demo

  • Merge pull request #28 from osrf/pointcloudpacked Bridge point cloud packed

  • Contributors: Nate Koenig, chapulina

  • Battery state (#30)

  • Packed demo (#29) * adding demo for point cloud packed bridge * correct rviz file * RGBD bridged cloud demo

  • Merge pull request #28 from osrf/pointcloudpacked Bridge point cloud packed

  • Contributors: Nate Koenig, chapulina

0.4.0 (2019-07-16)

  • tests and reverse bridge for pointcloud

  • Bridge point cloud packed

  • Contributors: Nate Koenig

0.3.1 (2019-07-01)

0.3.0 (2019-06-28)

  • 0.2.0

  • Conversion between nav_msgs/Odometry and ignition::msgs::Odometry (#22) * Conversion between nav_msgs/Odometry and ignition::msgs::Odometry. * Update documentation. * More time to run tests * Cleaning test_utils. * Remove explicit ROS dependencies for Travis. * diff drive demo with cmd_vel and odom * process child frame id

  • Fluid pressure (#20) * screenshots * missing IMU * Fluid pressure * Fix tests.

  • Demos package (#19) * Start of demos package: camera * IMU * depth camera * magnetometer * lidar, base launch * READMEs, RGBD camera * screenshots * missing IMU * set plugin path env * It’s best to always set it

  • Point clouds for RGBD cameras (#17) * Beginning of point cloud package * Populating image data, but result is not correct. Must find out where’s the source of the problem. * RGB -> BGR: why? * Cleanup code and example * pointcloud -> point_cloud * add keys - how was this working before? * install wget * well, we need ign-gz2 :sweat_smile: * README update * PR feedback * .travis/build: rosdep skip ignition keys (#18) * .travis/build: rosdep skip ignition keys * Update build

  • Move package to subfolder, add metapackage (#16)

  • Contributors: Carlos Agüero, Nate Koenig, chapulina

0.2.2 (2019-05-20)

0.2.1 (2019-05-11)

0.2.0 (2019-05-09)

0.1.0 (2019-03-20)