diff --git a/CMakeLists.txt b/CMakeLists.txt index 28f862fd..f6b6ac87 100644 --- a/CMakeLists.txt +++ b/CMakeLists.txt @@ -3,7 +3,7 @@ cmake_minimum_required(VERSION 3.10.2 FATAL_ERROR) #============================================================================ # Initialize the project #============================================================================ -project(ignition-msgs6 VERSION 6.5.0) +project(ignition-msgs6 VERSION 6.6.0) #============================================================================ # Find ignition-cmake diff --git a/Changelog.md b/Changelog.md index 8d897802..9e164191 100644 --- a/Changelog.md +++ b/Changelog.md @@ -1,5 +1,19 @@ ## Ignition Msgs 6.x +### Ignition Msgs 6.6.0 (2021-08-30) + +1. Adds PerformanceSensorMetrics proto message. + * [Pull request #172](https://github.com/ignitionrobotics/ign-msgs/pull/172) + +1. Detect ign instead of using cmake module to check for ignition-tools + * [Pull request #166](https://github.com/ignitionrobotics/ign-msgs/pull/166) + +1. Bazel build support for ign-msgs6 + * [Pull request #95](https://github.com/ignitionrobotics/ign-msgs/pull/95) + +1. Remove tools/code_check and update codecov + * [Pull request #164](https://github.com/ignitionrobotics/ign-msgs/pull/164) + ### Ignition Msgs 6.5.0 (2021-04-06) 1. Added particle_emitter vector message @@ -83,11 +97,11 @@ ### Ignition Msgs 5.7.0 (2021-03-17) -1. Add ignition version of nav_msgs/OccupancyGrid (backport #138) +1. Add ignition version of nav_msgs/OccupancyGrid (backport #138) * [Pull request 143](https://github.com/ignitionrobotics/ign-msgs/pull/143) * [Pull request 143](https://github.com/ignitionrobotics/ign-msgs/pull/138) -1. Master branch updates +1. Master branch updates * [Pull request 141](https://github.com/ignitionrobotics/ign-msgs/pull/141) 1. Add windows installation; move installation in README to tutorial