From 027b538874118215078a1c48c0ad26adf48966c2 Mon Sep 17 00:00:00 2001 From: Stephen Brawner Date: Tue, 24 Nov 2020 17:48:24 -0800 Subject: [PATCH] Update QDs to QL 1 Signed-off-by: Stephen Brawner --- diagnostic_msgs/QUALITY_DECLARATION.md | 16 ++++++++-------- diagnostic_msgs/README.md | 2 +- geometry_msgs/QUALITY_DECLARATION.md | 12 ++++++------ geometry_msgs/README.md | 2 +- nav_msgs/QUALITY_DECLARATION.md | 16 ++++++++-------- sensor_msgs/QUALITY_DECLARATION.md | 22 +++++++++++----------- sensor_msgs/README.md | 2 +- shape_msgs/QUALITY_DECLARATION.md | 12 ++++++------ shape_msgs/README.md | 2 +- std_msgs/QUALITY_DECLARATION.md | 12 ++++++------ std_msgs/README.md | 2 +- std_srvs/QUALITY_DECLARATION.md | 10 +++++----- std_srvs/README.md | 2 +- stereo_msgs/QUALITY_DECLARATION.md | 14 +++++++------- stereo_msgs/README.md | 2 +- trajectory_msgs/QUALITY_DECLARATION.md | 16 ++++++++-------- visualization_msgs/QUALITY_DECLARATION.md | 16 ++++++++-------- 17 files changed, 80 insertions(+), 80 deletions(-) diff --git a/diagnostic_msgs/QUALITY_DECLARATION.md b/diagnostic_msgs/QUALITY_DECLARATION.md index addfdde8..1b087af4 100644 --- a/diagnostic_msgs/QUALITY_DECLARATION.md +++ b/diagnostic_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `diagnostic_msgs` pac # `diagnostic_msgs` Quality Declaration -The package `diagnostic_msgs` claims to be in the **Quality Level 2** category. +The package `diagnostic_msgs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 3 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,17 +82,17 @@ There are no currently copyrighted source files in this package. `diagnostic_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/diagnostic_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/diagnostic_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`diagnostic_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `builtin_interfaces`: [QL 2](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) -* `geometry_msgs`: [QL 2](../geometry_msgs/QUALITY_DECLARATION.md) -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) -* `std_msgs`: [QL 2](../std_msgs/QUALITY_DECLARATION.md) +`diagnostic_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1** +* `builtin_interfaces`: [QUALITY DECLARATION](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) +* `geometry_msgs`: [QUALITY DECLARATION](../geometry_msgs/QUALITY_DECLARATION.md) +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +* `std_msgs`: [QUALITY DECLARATION](../std_msgs/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/diagnostic_msgs/README.md b/diagnostic_msgs/README.md index 257c4d1c..31c54a5e 100644 --- a/diagnostic_msgs/README.md +++ b/diagnostic_msgs/README.md @@ -14,4 +14,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index. * [SelfTest](srv/SelfTest.srv): Call this service to perform a diagnostic check. ## Quality Declaration -This package claims to be in the **Quality Level 2** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. +This package claims to be in the **Quality Level 1** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. diff --git a/geometry_msgs/QUALITY_DECLARATION.md b/geometry_msgs/QUALITY_DECLARATION.md index 630302f7..daafab56 100644 --- a/geometry_msgs/QUALITY_DECLARATION.md +++ b/geometry_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `geometry_msgs` packa # `geometry_msgs` Quality Declaration -The package `geometry_msgs` claims to be in the **Quality Level 2** category. +The package `geometry_msgs` claims to be in the **Quality Level 1** category. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,15 +82,15 @@ There are no currently copyrighted source files in this package. `geometry_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/geometry_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/geometry_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`geometry_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) -* `std_msgs`: [QL 2](../std_msgs/QUALITY_DECLARATION.md) +`geometry_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +* `std_msgs`: [QUALITY DECLARATION](../std_msgs/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/geometry_msgs/README.md b/geometry_msgs/README.md index 1cee1929..4a2b171f 100644 --- a/geometry_msgs/README.md +++ b/geometry_msgs/README.md @@ -37,4 +37,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index. ## Quality Declaration -This package claims to be in the **Quality Level 2** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. +This package claims to be in the **Quality Level 1** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. diff --git a/nav_msgs/QUALITY_DECLARATION.md b/nav_msgs/QUALITY_DECLARATION.md index 395876f1..2196cba6 100644 --- a/nav_msgs/QUALITY_DECLARATION.md +++ b/nav_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `nav_msgs` package, b # `nav_msgs` Quality Declaration -The package `nav_msgs` claims to be in the **Quality Level 2** category. +The package `nav_msgs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,17 +82,17 @@ There are no currently copyrighted source files in this package. `nav_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/nav_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/nav_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`nav_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `builtin_interfaces`: [QL 2](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) -* `geometry_msgs`: [QL 2](../geometry_msgs/QUALITY_DECLARATION.md) -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) -* `std_msgs`: [QL 2](../std_msgs/QUALITY_DECLARATION.md) +`nav_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `builtin_interfaces`: [QUALITY DECLARATION](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) +* `geometry_msgs`: [QUALITY DECLARATION](../geometry_msgs/QUALITY_DECLARATION.md) +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +* `std_msgs`: [QUALITY DECLARATION](../std_msgs/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/sensor_msgs/QUALITY_DECLARATION.md b/sensor_msgs/QUALITY_DECLARATION.md index b97379c2..cb30e144 100644 --- a/sensor_msgs/QUALITY_DECLARATION.md +++ b/sensor_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `sensor_msgs` package # `sensor_msgs` Quality Declaration -The package `sensor_msgs` claims to be in the **Quality Level 2** category. +The package `sensor_msgs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -70,7 +70,7 @@ The license for `sensor_msgs` is Apache 2.0, the type is declared in the [packag There is an automated test which runs a linter that ensures each file has a license statement. -Most recent test results can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/sensor_msgs/copyright/) +Most recent test results can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/sensor_msgs/copyright/) ### Copyright Statements [3.iv] @@ -83,14 +83,14 @@ There are no currently copyrighted source files in this package. Most of the features in sensor_msgs have corresponding tests which simulate typical usage, and they are located in the `test` directory. New features are required to have tests before being added. -Results of these feature tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/(root)/sensor_msgs/) +Results of these feature tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/(root)/sensor_msgs/) ### Public API Testing [4.ii] Each part of the public non-generated C++ API has tests, and new additions or changes to the public API require tests before being added. The tests aim to cover both typical usage and corner cases, but are quantified by contributing to code coverage. -Results of these API tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/(root)/sensor_msgs/) +Results of these API tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/(root)/sensor_msgs/) ### Coverage [4.iii] @@ -104,17 +104,17 @@ Results of these API tests can be found [here](http://build.ros2.org/view/Epr/jo `sensor_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/sensor_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/sensor_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`sensor_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `builtin_interfaces`: [QL 2](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) -* `geometry_msgs`: [QL 2](../geometry_msgs/QUALITY_DECLARATION.md) -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) -* `std_msgs`: [QL 2](../std_msgs/QUALITY_DECLARATION.md) +`sensor_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `builtin_interfaces`: [QUALITY DECLARATION](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) +* `geometry_msgs`: [QUALITY DECLARATION](../geometry_msgs/QUALITY_DECLARATION.md) +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +* `std_msgs`: [QUALITY DECLARATION](../std_msgs/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/sensor_msgs/README.md b/sensor_msgs/README.md index 4aebf0b4..7d332bae 100644 --- a/sensor_msgs/README.md +++ b/sensor_msgs/README.md @@ -48,4 +48,4 @@ This package provides some common C++ functionality relating to manipulating a c * [SetCameraInfo](srv/SetCameraInfo.srv): Request that a camera stores the given CameraInfo as that camera's calibration information. ## Quality Declaration -This package claims to be in the **Quality Level 2** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. +This package claims to be in the **Quality Level 1** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. diff --git a/shape_msgs/QUALITY_DECLARATION.md b/shape_msgs/QUALITY_DECLARATION.md index e049b375..194d9305 100644 --- a/shape_msgs/QUALITY_DECLARATION.md +++ b/shape_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `shape_msgs` package, # `shape_msgs` Quality Declaration -The package `shape_msgs` claims to be in the **Quality Level 2** category. +The package `shape_msgs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,15 +82,15 @@ There are no currently copyrighted source files in this package. `shape_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/shape_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/shape_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`shape_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `geometry_msgs`: [QL 2](../geometry_msgs/QUALITY_DECLARATION.md) -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +`shape_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `geometry_msgs`: [QUALITY DECLARATION](../geometry_msgs/QUALITY_DECLARATION.md) +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/shape_msgs/README.md b/shape_msgs/README.md index c76027be..f1c7b231 100644 --- a/shape_msgs/README.md +++ b/shape_msgs/README.md @@ -11,4 +11,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index. * [SolidPrimitive](msg/SolidPrimitive.msg): Describe a simple shape primitive like a box, a sphere, a cylinder, and a cone. ## Quality Declaration -This package claims to be in the **Quality Level 2** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. +This package claims to be in the **Quality Level 1** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. diff --git a/std_msgs/QUALITY_DECLARATION.md b/std_msgs/QUALITY_DECLARATION.md index 33b59bb5..60bd3adc 100644 --- a/std_msgs/QUALITY_DECLARATION.md +++ b/std_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `std_msgs` package, b # `std_msgs` Quality Declaration -The package `std_msgs` claims to be in the **Quality Level 2** category. +The package `std_msgs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,15 +82,15 @@ There are no currently copyrighted source files in this package. `std_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/std_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/std_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`std_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `builtin_interfaces`: [QL 2](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +`std_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `builtin_interfaces`: [QUALITY DECLARATION](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/std_msgs/README.md b/std_msgs/README.md index e750fb78..74df61cf 100644 --- a/std_msgs/README.md +++ b/std_msgs/README.md @@ -45,4 +45,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index. * [UInt8MultiArray](msg/UInt8MultiArray.msg) ## Quality Declaration -This package claims to be in the **Quality Level 2** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. +This package claims to be in the **Quality Level 1** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. diff --git a/std_srvs/QUALITY_DECLARATION.md b/std_srvs/QUALITY_DECLARATION.md index 7103ff9b..cfd3e54d 100644 --- a/std_srvs/QUALITY_DECLARATION.md +++ b/std_srvs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `std_srvs` package, b # `std_srvs` Quality Declaration -The package `std_srvs` claims to be in the **Quality Level 2** category. +The package `std_srvs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,14 +82,14 @@ There are no currently copyrighted source files in this package. `std_srvs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/std_srvs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/std_srvs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`std_srvs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +`std_srvs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/std_srvs/README.md b/std_srvs/README.md index 03ef25d2..e83568c1 100644 --- a/std_srvs/README.md +++ b/std_srvs/README.md @@ -11,4 +11,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index. ## Quality Declaration -This package claims to be in the **Quality Level 2** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. +This package claims to be in the **Quality Level 1** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. diff --git a/stereo_msgs/QUALITY_DECLARATION.md b/stereo_msgs/QUALITY_DECLARATION.md index 8316c26e..15598673 100644 --- a/stereo_msgs/QUALITY_DECLARATION.md +++ b/stereo_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `stereo_msgs` package # `stereo_msgs` Quality Declaration -The package `stereo_msgs` claims to be in the **Quality Level 2** category. +The package `stereo_msgs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,16 +82,16 @@ There are no currently copyrighted source files in this package. `stereo_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/stereo_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/stereo_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`stereo_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) -* `sensor_msgs`: [QL 2](../sensor_msgs/QUALITY_DECLARATION.md) -* `std_msgs`: [QL 2](../std_msgs/QUALITY_DECLARATION.md) +`stereo_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +* `sensor_msgs`: [QUALITY DECLARATION](../sensor_msgs/QUALITY_DECLARATION.md) +* `std_msgs`: [QUALITY DECLARATION](../std_msgs/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/stereo_msgs/README.md b/stereo_msgs/README.md index b94d2ee6..d9b5a1f3 100644 --- a/stereo_msgs/README.md +++ b/stereo_msgs/README.md @@ -8,4 +8,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index. * [DisparityImage](msg/DisparityImage.msg): A floating point disparity image with metadata. ## Quality Declaration -This package claims to be in the **Quality Level 2** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. +This package claims to be in the **Quality Level 1** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details. diff --git a/trajectory_msgs/QUALITY_DECLARATION.md b/trajectory_msgs/QUALITY_DECLARATION.md index 88ad0693..c1dc63a7 100644 --- a/trajectory_msgs/QUALITY_DECLARATION.md +++ b/trajectory_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `trajectory_msgs` pac # `trajectory_msgs` Quality Declaration -The package `trajectory_msgs` claims to be in the **Quality Level 2** category. +The package `trajectory_msgs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,17 +82,17 @@ There are no currently copyrighted source files in this package. `trajectory_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/trajectory_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/trajectory_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`trajectory_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `builtin_interfaces`: [QL 2](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) -* `geometry_msgs`: [QL 2](../geometry_msgs/QUALITY_DECLARATION.md) -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) -* `std_msgs`: [QL 2](../std_msgs/QUALITY_DECLARATION.md) +`trajectory_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `builtin_interfaces`: [QUALITY DECLARATION](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) +* `geometry_msgs`: [QUALITY DECLARATION](../geometry_msgs/QUALITY_DECLARATION.md) +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +* `std_msgs`: [QUALITY DECLARATION](../std_msgs/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API. diff --git a/visualization_msgs/QUALITY_DECLARATION.md b/visualization_msgs/QUALITY_DECLARATION.md index ba6dc914..30a7ad7f 100644 --- a/visualization_msgs/QUALITY_DECLARATION.md +++ b/visualization_msgs/QUALITY_DECLARATION.md @@ -2,9 +2,9 @@ This document is a declaration of software quality for the `visualization_msgs` # `visualization_msgs` Quality Declaration -The package `visualization_msgs` claims to be in the **Quality Level 2** category. +The package `visualization_msgs` claims to be in the **Quality Level 1** category as long as it is used with a **Quality Level 1** middleware. -Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 2 in REP-2004](https://www.ros.org/reps/rep-2004.html). +Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 1 in REP-2004](https://www.ros.org/reps/rep-2004.html). ## Version Policy [1] @@ -82,17 +82,17 @@ There are no currently copyrighted source files in this package. `visualization_msgs` uses and passes all the standard linters and static analysis tools for its generated C++ and Python code to ensure it follows the [ROS 2 Developer Guide](https://index.ros.org/doc/ros2/Contributing/Developer-Guide/#linters). -Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Epr/job/Epr__common_interfaces__ubuntu_bionic_amd64/lastBuild/testReport/visualization_msgs/). +Results of the nightly linter tests can be found [here](http://build.ros2.org/view/Rpr/job/Rpr__common_interfaces__ubuntu_focal_amd64/lastCompletedBuild/testReport/visualization_msgs/). ## Dependencies [5] ### Direct Runtime ROS Dependencies [5.i]/[5.ii] -`visualization_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 2: -* `builtin_interfaces`: [QL 2](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) -* `geometry_msgs`: [QL 2](../geometry_msgs/QUALITY_DECLARATION.md) -* `rosidl_default_runtime` [QL 2](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) -* `std_msgs`: [QL 2](../std_msgs/QUALITY_DECLARATION.md) +`visualization_msgs` has the following runtime ROS dependencies, which are at **Quality Level 1**: +* `builtin_interfaces`: [QUALITY DECLARATION](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md) +* `geometry_msgs`: [QUALITY DECLARATION](../geometry_msgs/QUALITY_DECLARATION.md) +* `rosidl_default_runtime` [QUALITY DECLARATION](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md) +* `std_msgs`: [QUALITY DECLARATION](../std_msgs/QUALITY_DECLARATION.md) It has several "buildtool" dependencies, which do not affect the resulting quality of the package, because they do not contribute to the public library API.