Skip to content

Commit

Permalink
Update Quality levels to level 3 (#124)
Browse files Browse the repository at this point in the history
* Update Quality levels to level 3

Signed-off-by: Stephen Brawner <brawner@gmail.com>

* Address PR Feedback

Signed-off-by: Stephen Brawner <brawner@gmail.com>
  • Loading branch information
brawner authored and ahcorde committed Oct 28, 2020
1 parent 99b8066 commit ee5894f
Show file tree
Hide file tree
Showing 20 changed files with 70 additions and 70 deletions.
14 changes: 7 additions & 7 deletions diagnostic_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `diagnostic_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,11 +88,11 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`diagnostic_msgs` has the following runtime ROS dependencies:
* `builtin_interfaces`
* `geometry_msgs`
* `rosidl_default_runtime`
* `std_msgs`
`diagnostic_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `builtin_interfaces`: [QL 3](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md)
* `geometry_msgs`: [QL 3](../geometry_msgs/QUALITY_DECLARATION.md)
* `rosidl_default_runtime` [QL 3](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md)
* `std_msgs`: [QL 3](../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.

Expand Down
2 changes: 1 addition & 1 deletion diagnostic_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
10 changes: 5 additions & 5 deletions geometry_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `geometry_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,9 +88,9 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`geometry_msgs` has the following runtime ROS dependencies:
* `rosidl_default_runtime`
* `std_msgs`
`geometry_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `rosidl_default_runtime` [QL 3](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md)
* `std_msgs`: [QL 3](../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.

Expand Down
2 changes: 1 addition & 1 deletion geometry_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
14 changes: 7 additions & 7 deletions nav_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `nav_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,11 +88,11 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`nav_msgs` has the following runtime ROS dependencies:
* `builtin_interfaces`
* `geometry_msgs`
* `rosidl_default_runtime`
* `std_msgs`
`nav_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `builtin_interfaces`: [QL 3](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md)
* `geometry_msgs`: [QL 3](../geometry_msgs/QUALITY_DECLARATION.md)
* `rosidl_default_runtime` [QL 3](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md)
* `std_msgs`: [QL 3](../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.

Expand Down
2 changes: 1 addition & 1 deletion nav_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -19,4 +19,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index.
* [SetMap](srv/SetMap.srv): Set a new map together with an initial pose.

## Quality Declaration
This package claims to be in the **Quality Level 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
14 changes: 7 additions & 7 deletions sensor_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `sensor_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -110,11 +110,11 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`sensor_msgs` has the following runtime ROS dependencies:
* `builtin_interfaces`
* `geometry_msgs`
* `rosidl_default_runtime`
* `std_msgs`
`sensor_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `builtin_interfaces`: [QL 3](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md)
* `geometry_msgs`: [QL 3](../geometry_msgs/QUALITY_DECLARATION.md)
* `rosidl_default_runtime` [QL 3](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md)
* `std_msgs`: [QL 3](../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.

Expand Down
2 changes: 1 addition & 1 deletion sensor_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
10 changes: 5 additions & 5 deletions shape_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `shape_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,9 +88,9 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`shape_msgs` has the following runtime ROS dependencies:
* `geometry_msgs`
* `rosidl_default_runtime`
`shape_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `geometry_msgs`: [QL 3](../geometry_msgs/QUALITY_DECLARATION.md)
* `rosidl_default_runtime` [QL 3](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.

Expand Down
2 changes: 1 addition & 1 deletion shape_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
10 changes: 5 additions & 5 deletions std_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `std_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,9 +88,9 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`std_msgs` has the following runtime ROS dependencies:
* `builtin_interfaces`
* `rosidl_default_runtime`
`std_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `builtin_interfaces`: [QL 3](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md)
* `rosidl_default_runtime` [QL 3](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.

Expand Down
2 changes: 1 addition & 1 deletion std_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
8 changes: 4 additions & 4 deletions std_srvs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `std_srvs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,8 +88,8 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`std_srvs` has the following runtime ROS dependencies:
* `rosidl_default_runtime`
`std_srvs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `rosidl_default_runtime` [QL 3](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.

Expand Down
2 changes: 1 addition & 1 deletion std_srvs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
12 changes: 6 additions & 6 deletions stereo_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `stereo_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,10 +88,10 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`stereo_msgs` has the following runtime ROS dependencies:
* `rosidl_default_runtime`
* `sensor_msgs`
* `std_msgs`
`stereo_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `rosidl_default_runtime` [QL 3](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md)
* `sensor_msgs`: [QL 3](../sensor_msgs/QUALITY_DECLARATION.md)
* `std_msgs`: [QL 3](../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.

Expand Down
2 changes: 1 addition & 1 deletion stereo_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
14 changes: 7 additions & 7 deletions trajectory_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `trajectory_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,11 +88,11 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`trajectory_msgs` has the following runtime ROS dependencies:
* `builtin_interfaces`
* `geometry_msgs`
* `rosidl_default_runtime`
* `std_msgs`
`trajectory_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `builtin_interfaces`: [QL 3](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md)
* `geometry_msgs`: [QL 3](../geometry_msgs/QUALITY_DECLARATION.md)
* `rosidl_default_runtime` [QL 3](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md)
* `std_msgs`: [QL 3](../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.

Expand Down
2 changes: 1 addition & 1 deletion trajectory_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -11,4 +11,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index.
* [MultiDOFJointTrajectoryPoint](msg/MultiDOFJointTrajectoryPoint.msg): A single configuration for multiple joints in a MultiDOFJointTrajectory.

## Quality Declaration
This package claims to be in the **Quality Level 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
14 changes: 7 additions & 7 deletions visualization_msgs/QUALITY_DECLARATION.md
Original file line number Diff line number Diff line change
Expand Up @@ -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 4** category.
The package `visualization_msgs` claims to be in the **Quality Level 3** category.

Below are the rationales, notes, and caveats for this claim, organized by each requirement listed in the [Package Requirements for Quality Level 4 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 3 in REP-2004](https://www.ros.org/reps/rep-2004.html).

## Version Policy [1]

Expand Down Expand Up @@ -88,11 +88,11 @@ Results of the nightly linter tests can be found [here](http://build.ros2.org/vi

### Direct Runtime ROS Dependencies [5.i]/[5.ii]

`visualization_msgs` has the following runtime ROS dependencies:
* `builtin_interfaces`
* `geometry_msgs`
* `rosidl_default_runtime`
* `std_msgs`
`visualization_msgs` has the following runtime ROS dependencies, which are at or above Quality Level 3:
* `builtin_interfaces`: [QL 3](https://github.com/ros2/rcl_interfaces/tree/master/builtin_interfaces/QUALITY_DECLARATION.md)
* `geometry_msgs`: [QL 3](../geometry_msgs/QUALITY_DECLARATION.md)
* `rosidl_default_runtime` [QL 3](https://github.com/ros2/rosidl_defaults/tree/master/rosidl_default_runtime/QUALITY_DECLARATION.md)
* `std_msgs`: [QL 3](../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.

Expand Down
2 changes: 1 addition & 1 deletion visualization_msgs/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -22,4 +22,4 @@ For more information about ROS 2 interfaces, see [index.ros2.org](https://index.
* [GetInteractiveMarkers.srv](srv/GetInteractiveMarkers.srv): Get the currently available interactive markers.

## Quality Declaration
This package claims to be in the **Quality Level 4** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.
This package claims to be in the **Quality Level 3** category, see the [Quality Declaration](QUALITY_DECLARATION.md) for more details.

0 comments on commit ee5894f

Please sign in to comment.