Changelog for package ros_ign_bridge
0.111.2 (2021-12-30)
- [noetic] 🏁 Dome EOL (#197)
 
- Don't double-build convert.cpp (#184)
 
- 🥳 [Noetic] Tweaks to bridge tutorial (#180)
 
- Contributors: Louise Poubel, Michael Carroll
 
 
0.111.1 (2021-07-20)
- Check imu orientation field (#168)
 
- [noetic] Update version docs, add Fortress (#166)
 
- Fix catkin_testing warning (#163)
 
- Add support for nav_msgs/OccupancyGrid (#137)
 
- [noetic] Edifice support (#139)
 
- Bridge int32 messages (#138)
 
- Add visualization_msgs/Marker (#136)
* Add support for std_msgs/ColorRGBA
* Add support for visualization_msgs/Marker
 
- Add support for Pose_V to PoseArray (#134)
 
- Prevent segfault caused by missing values in sensor_msgs::JointState (#135)
 
- Add dome + melodic to CI (#126)
 
- [noetic] Update releases (#106)
 
- Contributors: Alejandro Hernández Cordero, Ian Chen, Jose Luis Rivero, Louise Poubel, Martin Pecka, Michael Carroll, Nate Koenig, Tobias Fischer
 
 
0.111.0 (2020-07-23)
- Noetic support (#93)
Co-authored-by: Jose Luis Rivero <jrivero@osrfoundation.org>
 
- Install only what's necessary, rename builtin_interfaces (#96)
 
- Move headers to src, rename builtin_interfaces (#96)
 
- Choose collection based on environment variable (#72)
* Choose collection based on the environment variable IGNITION_VERSION
 
- Contributors: Louise Poubel
 
 
0.9.2 (2020-05-14)
0.9.1 (2020-05-13)
0.9.0 (2020-05-13)
- Add ignition::msgs::Pose_V to tf2_msgs::TFMessage conversion (#67)
* add ign pose_v to ros tf2_message bridge
* add tf2 msgs dependency
 
- Add Float64 to ignition Double conversions.  This is needed for suppo… (#64)
* Add Float64 to ignition Double conversions.  This is needed for supporting joint controller (such as for a pan/tilt gimbal)
* Update README to reflect that bridge now supports double message conversions.
 
- Update Melodic docs (#61)
 
- Patches for Citadel release (#56)
* Patches for Citadel release
* Mention Citadel or Blueprint deps
 
- Merge pull request #55 from osrf/fix_repo_url
Update repo URL in README install isntructions
 
- Update repo URL in README install isntructions
 
- [Citadel] Citadel support (#48)
* Citadel support
* more citadel deps
* addressing feedback, fix typos and better find logic
* fix CI
 
- Contributors: Jose Luis Rivero, chapulina, iche033, realdealneil
 
 
0.8.0 (2019-11-22)
- Add support for std_msgs/Empty (#52)
 
- Add support for std_msgs/Bool (#49)
Signed-off-by: Michael Carroll <michael@openrobotics.org>
 
- Add replaces for each package (#46)
 
- Make all API and comments ROS-version agnostic
Signed-off-by: Louise Poubel <louise@openrobotics.org>
 
- Rename packages and fix compilation + tests
Signed-off-by: Louise Poubel <louise@openrobotics.org>
 
- Move files ros1 -> ros
Signed-off-by: Louise Poubel <louise@openrobotics.org>
 
- Contributors: Addisu Taddese, Louise Poubel, Michael Carroll, 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)