From a8db2a1aa3999edfda5967bff4f17d64e2f4cd6b Mon Sep 17 00:00:00 2001 From: =?UTF-8?q?Alejandro=20Hern=C3=A1ndez=20Cordero?= Date: Thu, 27 Jul 2023 13:56:59 +0200 Subject: [PATCH] TODOs in main MIME-Version: 1.0 Content-Type: text/plain; charset=UTF-8 Content-Transfer-Encoding: 8bit Signed-off-by: Alejandro Hernández Cordero --- include/CMakeLists.txt | 1 - include/gz/math/Helpers.hh | 16 ----- include/ignition/math.hh | 19 ------ .../math/AdditivelySeparableScalarField3.hh | 19 ------ include/ignition/math/Angle.hh | 23 ------- include/ignition/math/AxisAlignedBox.hh | 19 ------ include/ignition/math/Box.hh | 19 ------ include/ignition/math/Capsule.hh | 19 ------ include/ignition/math/Color.hh | 19 ------ include/ignition/math/Cylinder.hh | 19 ------ include/ignition/math/DiffDriveOdometry.hh | 19 ------ include/ignition/math/Ellipsoid.hh | 19 ------ include/ignition/math/Export.hh | 19 ------ include/ignition/math/Filter.hh | 19 ------ include/ignition/math/Frustum.hh | 19 ------ include/ignition/math/GaussMarkovProcess.hh | 19 ------ include/ignition/math/Helpers.hh | 31 ---------- include/ignition/math/Inertial.hh | 19 ------ include/ignition/math/Interval.hh | 19 ------ include/ignition/math/Kmeans.hh | 19 ------ include/ignition/math/Line2.hh | 19 ------ include/ignition/math/Line3.hh | 19 ------ include/ignition/math/MassMatrix3.hh | 19 ------ include/ignition/math/Material.hh | 19 ------ include/ignition/math/MaterialType.hh | 19 ------ include/ignition/math/Matrix3.hh | 19 ------ include/ignition/math/Matrix4.hh | 19 ------ include/ignition/math/Matrix6.hh | 19 ------ include/ignition/math/MovingWindowFilter.hh | 19 ------ include/ignition/math/OrientedBox.hh | 19 ------ include/ignition/math/PID.hh | 19 ------ .../ignition/math/PiecewiseScalarField3.hh | 19 ------ include/ignition/math/Plane.hh | 19 ------ include/ignition/math/Polynomial3.hh | 19 ------ include/ignition/math/Pose3.hh | 19 ------ include/ignition/math/Quaternion.hh | 19 ------ include/ignition/math/Rand.hh | 19 ------ include/ignition/math/Region3.hh | 19 ------ include/ignition/math/RollingMean.hh | 19 ------ include/ignition/math/RotationSpline.hh | 19 ------ include/ignition/math/SemanticVersion.hh | 19 ------ include/ignition/math/SignalStats.hh | 19 ------ include/ignition/math/SpeedLimiter.hh | 19 ------ include/ignition/math/Sphere.hh | 19 ------ include/ignition/math/SphericalCoordinates.hh | 19 ------ include/ignition/math/Spline.hh | 19 ------ include/ignition/math/Stopwatch.hh | 19 ------ include/ignition/math/Temperature.hh | 19 ------ include/ignition/math/Triangle.hh | 19 ------ include/ignition/math/Triangle3.hh | 19 ------ include/ignition/math/Vector2.hh | 19 ------ include/ignition/math/Vector3.hh | 19 ------ include/ignition/math/Vector3Stats.hh | 19 ------ include/ignition/math/Vector4.hh | 19 ------ .../math/VolumetricGridLookupField.hh | 19 ------ include/ignition/math/config.hh | 46 -------------- include/ignition/math/detail/AxisIndex.hh | 19 ------ include/ignition/math/detail/Box.hh | 19 ------ include/ignition/math/detail/Capsule.hh | 19 ------ include/ignition/math/detail/Cylinder.hh | 19 ------ include/ignition/math/detail/Ellipsoid.hh | 19 ------ include/ignition/math/detail/Export.hh | 19 ------ .../math/detail/InterpolationPoint.hh | 19 ------ include/ignition/math/detail/Sphere.hh | 19 ------ .../ignition/math/detail/WellOrderedVector.hh | 19 ------ include/ignition/math/graph/Edge.hh | 19 ------ include/ignition/math/graph/Graph.hh | 19 ------ .../ignition/math/graph/GraphAlgorithms.hh | 19 ------ include/ignition/math/graph/Vertex.hh | 19 ------ src/Helpers.i | 28 --------- src/python_pybind11/src/Helpers.cc | 62 +------------------ src/ruby/Helpers.i | 34 ---------- test/integration/deprecated_TEST.cc | 33 ---------- 73 files changed, 1 insertion(+), 1489 deletions(-) delete mode 100644 include/ignition/math.hh delete mode 100644 include/ignition/math/AdditivelySeparableScalarField3.hh delete mode 100644 include/ignition/math/Angle.hh delete mode 100644 include/ignition/math/AxisAlignedBox.hh delete mode 100644 include/ignition/math/Box.hh delete mode 100644 include/ignition/math/Capsule.hh delete mode 100644 include/ignition/math/Color.hh delete mode 100644 include/ignition/math/Cylinder.hh delete mode 100644 include/ignition/math/DiffDriveOdometry.hh delete mode 100644 include/ignition/math/Ellipsoid.hh delete mode 100644 include/ignition/math/Export.hh delete mode 100644 include/ignition/math/Filter.hh delete mode 100644 include/ignition/math/Frustum.hh delete mode 100644 include/ignition/math/GaussMarkovProcess.hh delete mode 100644 include/ignition/math/Helpers.hh delete mode 100644 include/ignition/math/Inertial.hh delete mode 100644 include/ignition/math/Interval.hh delete mode 100644 include/ignition/math/Kmeans.hh delete mode 100644 include/ignition/math/Line2.hh delete mode 100644 include/ignition/math/Line3.hh delete mode 100644 include/ignition/math/MassMatrix3.hh delete mode 100644 include/ignition/math/Material.hh delete mode 100644 include/ignition/math/MaterialType.hh delete mode 100644 include/ignition/math/Matrix3.hh delete mode 100644 include/ignition/math/Matrix4.hh delete mode 100644 include/ignition/math/Matrix6.hh delete mode 100644 include/ignition/math/MovingWindowFilter.hh delete mode 100644 include/ignition/math/OrientedBox.hh delete mode 100644 include/ignition/math/PID.hh delete mode 100644 include/ignition/math/PiecewiseScalarField3.hh delete mode 100644 include/ignition/math/Plane.hh delete mode 100644 include/ignition/math/Polynomial3.hh delete mode 100644 include/ignition/math/Pose3.hh delete mode 100644 include/ignition/math/Quaternion.hh delete mode 100644 include/ignition/math/Rand.hh delete mode 100644 include/ignition/math/Region3.hh delete mode 100644 include/ignition/math/RollingMean.hh delete mode 100644 include/ignition/math/RotationSpline.hh delete mode 100644 include/ignition/math/SemanticVersion.hh delete mode 100644 include/ignition/math/SignalStats.hh delete mode 100644 include/ignition/math/SpeedLimiter.hh delete mode 100644 include/ignition/math/Sphere.hh delete mode 100644 include/ignition/math/SphericalCoordinates.hh delete mode 100644 include/ignition/math/Spline.hh delete mode 100644 include/ignition/math/Stopwatch.hh delete mode 100644 include/ignition/math/Temperature.hh delete mode 100644 include/ignition/math/Triangle.hh delete mode 100644 include/ignition/math/Triangle3.hh delete mode 100644 include/ignition/math/Vector2.hh delete mode 100644 include/ignition/math/Vector3.hh delete mode 100644 include/ignition/math/Vector3Stats.hh delete mode 100644 include/ignition/math/Vector4.hh delete mode 100644 include/ignition/math/VolumetricGridLookupField.hh delete mode 100644 include/ignition/math/config.hh delete mode 100644 include/ignition/math/detail/AxisIndex.hh delete mode 100644 include/ignition/math/detail/Box.hh delete mode 100644 include/ignition/math/detail/Capsule.hh delete mode 100644 include/ignition/math/detail/Cylinder.hh delete mode 100644 include/ignition/math/detail/Ellipsoid.hh delete mode 100644 include/ignition/math/detail/Export.hh delete mode 100644 include/ignition/math/detail/InterpolationPoint.hh delete mode 100644 include/ignition/math/detail/Sphere.hh delete mode 100644 include/ignition/math/detail/WellOrderedVector.hh delete mode 100644 include/ignition/math/graph/Edge.hh delete mode 100644 include/ignition/math/graph/Graph.hh delete mode 100644 include/ignition/math/graph/GraphAlgorithms.hh delete mode 100644 include/ignition/math/graph/Vertex.hh delete mode 100644 test/integration/deprecated_TEST.cc diff --git a/include/CMakeLists.txt b/include/CMakeLists.txt index 992a1312e..a35a0475e 100644 --- a/include/CMakeLists.txt +++ b/include/CMakeLists.txt @@ -1,2 +1 @@ add_subdirectory(gz) -install(DIRECTORY ignition DESTINATION ${GZ_INCLUDE_INSTALL_DIR_FULL}) diff --git a/include/gz/math/Helpers.hh b/include/gz/math/Helpers.hh index 609c97ad9..25be34fae 100644 --- a/include/gz/math/Helpers.hh +++ b/include/gz/math/Helpers.hh @@ -36,10 +36,6 @@ template constexpr T GZ_MASSMATRIX3_DEFAULT_TOLERANCE = T(10); -// TODO(CH3): Deprecated. Remove on tock. -template -constexpr T IGN_MASSMATRIX3_DEFAULT_TOLERANCE = T(10); - /// \brief Define GZ_PI, GZ_PI_2, and GZ_PI_4. /// This was put here for Windows support. #ifdef M_PI @@ -120,18 +116,6 @@ namespace gz /// \brief size_t type with a value of 9 static const size_t GZ_NINE_SIZE_T = 9u; - // TODO(CH3): Deprecated. Remove on tock. - constexpr auto GZ_DEPRECATED(7) IGN_ZERO_SIZE_T = &GZ_ZERO_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_ONE_SIZE_T = &GZ_ONE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_TWO_SIZE_T = &GZ_TWO_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_THREE_SIZE_T = &GZ_THREE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_FOUR_SIZE_T = &GZ_FOUR_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_FIVE_SIZE_T = &GZ_FIVE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_SIX_SIZE_T = &GZ_SIX_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_SEVEN_SIZE_T = &GZ_SEVEN_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_EIGHT_SIZE_T = &GZ_EIGHT_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_NINE_SIZE_T = &GZ_NINE_SIZE_T; - /// \brief Double maximum value. This value will be similar to 1.79769e+308 static const double MAX_D = std::numeric_limits::max(); diff --git a/include/ignition/math.hh b/include/ignition/math.hh deleted file mode 100644 index cad1e2c96..000000000 --- a/include/ignition/math.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/AdditivelySeparableScalarField3.hh b/include/ignition/math/AdditivelySeparableScalarField3.hh deleted file mode 100644 index 62620a374..000000000 --- a/include/ignition/math/AdditivelySeparableScalarField3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Angle.hh b/include/ignition/math/Angle.hh deleted file mode 100644 index 834fcc6e4..000000000 --- a/include/ignition/math/Angle.hh +++ /dev/null @@ -1,23 +0,0 @@ -/* - * Copyright (C) 2012 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include - -#define IGN_RTOD(r) GZ_RTOD(r) -#define IGN_DTOR(d) GZ_DTOR(d) -#define IGN_NORMALIZE(a) GZ_NORMALIZE(a) diff --git a/include/ignition/math/AxisAlignedBox.hh b/include/ignition/math/AxisAlignedBox.hh deleted file mode 100644 index 4229cbd72..000000000 --- a/include/ignition/math/AxisAlignedBox.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Box.hh b/include/ignition/math/Box.hh deleted file mode 100644 index f517d2dea..000000000 --- a/include/ignition/math/Box.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Capsule.hh b/include/ignition/math/Capsule.hh deleted file mode 100644 index cd30f01c4..000000000 --- a/include/ignition/math/Capsule.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Color.hh b/include/ignition/math/Color.hh deleted file mode 100644 index 4d25c3c78..000000000 --- a/include/ignition/math/Color.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Cylinder.hh b/include/ignition/math/Cylinder.hh deleted file mode 100644 index 9742d05ad..000000000 --- a/include/ignition/math/Cylinder.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/DiffDriveOdometry.hh b/include/ignition/math/DiffDriveOdometry.hh deleted file mode 100644 index 360400b56..000000000 --- a/include/ignition/math/DiffDriveOdometry.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Ellipsoid.hh b/include/ignition/math/Ellipsoid.hh deleted file mode 100644 index f836ca057..000000000 --- a/include/ignition/math/Ellipsoid.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Export.hh b/include/ignition/math/Export.hh deleted file mode 100644 index 04084226f..000000000 --- a/include/ignition/math/Export.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Filter.hh b/include/ignition/math/Filter.hh deleted file mode 100644 index 636aa4caf..000000000 --- a/include/ignition/math/Filter.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Frustum.hh b/include/ignition/math/Frustum.hh deleted file mode 100644 index 3b089d8ee..000000000 --- a/include/ignition/math/Frustum.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/GaussMarkovProcess.hh b/include/ignition/math/GaussMarkovProcess.hh deleted file mode 100644 index 7c9802c45..000000000 --- a/include/ignition/math/GaussMarkovProcess.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Helpers.hh b/include/ignition/math/Helpers.hh deleted file mode 100644 index 6690ec80e..000000000 --- a/include/ignition/math/Helpers.hh +++ /dev/null @@ -1,31 +0,0 @@ -/* - * Copyright (C) 2012 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include - -#define IGN_PI GZ_PI -#define IGN_PI_2 GZ_PI_2 -#define IGN_PI_4 GZ_PI_4 -#define IGN_SQRT2 GZ_SQRT2 - -#define IGN_FP_VOLATILE GZ_FP_VOLATILE - -#define IGN_SPHERE_VOLUME(_radius) GZ_SPHERE_VOLUME(_radius) -#define IGN_CYLINDER_VOLUME(_r, _l) GZ_CYLINDER_VOLUME(_r, _l) -#define IGN_BOX_VOLUME(_x, _y, _z) GZ_BOX_VOLUME(_x, _y, _z) -#define IGN_BOX_VOLUME_V(_v) GZ_BOX_VOLUME_V(_v) diff --git a/include/ignition/math/Inertial.hh b/include/ignition/math/Inertial.hh deleted file mode 100644 index 2f2b93e75..000000000 --- a/include/ignition/math/Inertial.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Interval.hh b/include/ignition/math/Interval.hh deleted file mode 100644 index ce17d0916..000000000 --- a/include/ignition/math/Interval.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Kmeans.hh b/include/ignition/math/Kmeans.hh deleted file mode 100644 index 7067b32e3..000000000 --- a/include/ignition/math/Kmeans.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Line2.hh b/include/ignition/math/Line2.hh deleted file mode 100644 index bbdefa9ea..000000000 --- a/include/ignition/math/Line2.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Line3.hh b/include/ignition/math/Line3.hh deleted file mode 100644 index 23795634a..000000000 --- a/include/ignition/math/Line3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/MassMatrix3.hh b/include/ignition/math/MassMatrix3.hh deleted file mode 100644 index b79e8c16c..000000000 --- a/include/ignition/math/MassMatrix3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Material.hh b/include/ignition/math/Material.hh deleted file mode 100644 index 1e57794db..000000000 --- a/include/ignition/math/Material.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/MaterialType.hh b/include/ignition/math/MaterialType.hh deleted file mode 100644 index a5cdb889f..000000000 --- a/include/ignition/math/MaterialType.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Matrix3.hh b/include/ignition/math/Matrix3.hh deleted file mode 100644 index 3deada8ff..000000000 --- a/include/ignition/math/Matrix3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Matrix4.hh b/include/ignition/math/Matrix4.hh deleted file mode 100644 index 4f5359cc0..000000000 --- a/include/ignition/math/Matrix4.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Matrix6.hh b/include/ignition/math/Matrix6.hh deleted file mode 100644 index 319f5c7e8..000000000 --- a/include/ignition/math/Matrix6.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/MovingWindowFilter.hh b/include/ignition/math/MovingWindowFilter.hh deleted file mode 100644 index 42550b5a2..000000000 --- a/include/ignition/math/MovingWindowFilter.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/OrientedBox.hh b/include/ignition/math/OrientedBox.hh deleted file mode 100644 index 5642ecb0e..000000000 --- a/include/ignition/math/OrientedBox.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/PID.hh b/include/ignition/math/PID.hh deleted file mode 100644 index dba527832..000000000 --- a/include/ignition/math/PID.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/PiecewiseScalarField3.hh b/include/ignition/math/PiecewiseScalarField3.hh deleted file mode 100644 index c52dd227b..000000000 --- a/include/ignition/math/PiecewiseScalarField3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Plane.hh b/include/ignition/math/Plane.hh deleted file mode 100644 index bf1fcf1a5..000000000 --- a/include/ignition/math/Plane.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Polynomial3.hh b/include/ignition/math/Polynomial3.hh deleted file mode 100644 index 9f1238926..000000000 --- a/include/ignition/math/Polynomial3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Pose3.hh b/include/ignition/math/Pose3.hh deleted file mode 100644 index 5981cc5f8..000000000 --- a/include/ignition/math/Pose3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Quaternion.hh b/include/ignition/math/Quaternion.hh deleted file mode 100644 index dc9900eec..000000000 --- a/include/ignition/math/Quaternion.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Rand.hh b/include/ignition/math/Rand.hh deleted file mode 100644 index 9bbd2e77f..000000000 --- a/include/ignition/math/Rand.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Region3.hh b/include/ignition/math/Region3.hh deleted file mode 100644 index 4b7564ef1..000000000 --- a/include/ignition/math/Region3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/RollingMean.hh b/include/ignition/math/RollingMean.hh deleted file mode 100644 index ce8f54411..000000000 --- a/include/ignition/math/RollingMean.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/RotationSpline.hh b/include/ignition/math/RotationSpline.hh deleted file mode 100644 index c403c7266..000000000 --- a/include/ignition/math/RotationSpline.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/SemanticVersion.hh b/include/ignition/math/SemanticVersion.hh deleted file mode 100644 index 903aa1f30..000000000 --- a/include/ignition/math/SemanticVersion.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/SignalStats.hh b/include/ignition/math/SignalStats.hh deleted file mode 100644 index 0682f8d5e..000000000 --- a/include/ignition/math/SignalStats.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/SpeedLimiter.hh b/include/ignition/math/SpeedLimiter.hh deleted file mode 100644 index 76ff2c8d2..000000000 --- a/include/ignition/math/SpeedLimiter.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Sphere.hh b/include/ignition/math/Sphere.hh deleted file mode 100644 index 6f398538f..000000000 --- a/include/ignition/math/Sphere.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/SphericalCoordinates.hh b/include/ignition/math/SphericalCoordinates.hh deleted file mode 100644 index c4109bce2..000000000 --- a/include/ignition/math/SphericalCoordinates.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Spline.hh b/include/ignition/math/Spline.hh deleted file mode 100644 index 47688d66e..000000000 --- a/include/ignition/math/Spline.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Stopwatch.hh b/include/ignition/math/Stopwatch.hh deleted file mode 100644 index 4354dda68..000000000 --- a/include/ignition/math/Stopwatch.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Temperature.hh b/include/ignition/math/Temperature.hh deleted file mode 100644 index 6fc6ea4a4..000000000 --- a/include/ignition/math/Temperature.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Triangle.hh b/include/ignition/math/Triangle.hh deleted file mode 100644 index 9fd46e9cc..000000000 --- a/include/ignition/math/Triangle.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Triangle3.hh b/include/ignition/math/Triangle3.hh deleted file mode 100644 index 423c1c04c..000000000 --- a/include/ignition/math/Triangle3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Vector2.hh b/include/ignition/math/Vector2.hh deleted file mode 100644 index 71f4d6861..000000000 --- a/include/ignition/math/Vector2.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Vector3.hh b/include/ignition/math/Vector3.hh deleted file mode 100644 index b8bbc8965..000000000 --- a/include/ignition/math/Vector3.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Vector3Stats.hh b/include/ignition/math/Vector3Stats.hh deleted file mode 100644 index af30f152d..000000000 --- a/include/ignition/math/Vector3Stats.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/Vector4.hh b/include/ignition/math/Vector4.hh deleted file mode 100644 index a41a0d2d4..000000000 --- a/include/ignition/math/Vector4.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/VolumetricGridLookupField.hh b/include/ignition/math/VolumetricGridLookupField.hh deleted file mode 100644 index eb9dd9891..000000000 --- a/include/ignition/math/VolumetricGridLookupField.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/config.hh b/include/ignition/math/config.hh deleted file mode 100644 index fcee8bf38..000000000 --- a/include/ignition/math/config.hh +++ /dev/null @@ -1,46 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#ifndef IGNITION_MATH__CONFIG_HH_ -#define IGNITION_MATH__CONFIG_HH_ - -#include - -#define IGNITION_MATH_MAJOR_VERSION GZ_MATH_MAJOR_VERSION -#define IGNITION_MATH_MINOR_VERSION GZ_MATH_MINOR_VERSION -#define IGNITION_MATH_PATCH_VERSION GZ_MATH_PATCH_VERSION - -#define IGNITION_MATH_VERSION GZ_MATH_VERSION -#define IGNITION_MATH_VERSION_FULL GZ_MATH_VERSION_FULL - -#define IGNITION_MATH_VERSION_NAMESPACE GZ_MATH_VERSION_NAMESPACE - -#define IGNITION_MATH_VERSION_HEADER GZ_MATH_VERSION_HEADER - -namespace gz -{ -} - -namespace ignition -{ - #ifndef SUPPRESS_IGNITION_HEADER_DEPRECATION - #pragma message("ignition namespace is deprecated! Use gz instead!") - #endif - using namespace gz; -} - -#endif diff --git a/include/ignition/math/detail/AxisIndex.hh b/include/ignition/math/detail/AxisIndex.hh deleted file mode 100644 index 818e6f60e..000000000 --- a/include/ignition/math/detail/AxisIndex.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/detail/Box.hh b/include/ignition/math/detail/Box.hh deleted file mode 100644 index 78d1b94e4..000000000 --- a/include/ignition/math/detail/Box.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2018 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/detail/Capsule.hh b/include/ignition/math/detail/Capsule.hh deleted file mode 100644 index 93db5c930..000000000 --- a/include/ignition/math/detail/Capsule.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2020 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/detail/Cylinder.hh b/include/ignition/math/detail/Cylinder.hh deleted file mode 100644 index b32e93af7..000000000 --- a/include/ignition/math/detail/Cylinder.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2018 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/detail/Ellipsoid.hh b/include/ignition/math/detail/Ellipsoid.hh deleted file mode 100644 index 721ed50e0..000000000 --- a/include/ignition/math/detail/Ellipsoid.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2020 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/detail/Export.hh b/include/ignition/math/detail/Export.hh deleted file mode 100644 index e3cdbfec4..000000000 --- a/include/ignition/math/detail/Export.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/detail/InterpolationPoint.hh b/include/ignition/math/detail/InterpolationPoint.hh deleted file mode 100644 index d47868b4b..000000000 --- a/include/ignition/math/detail/InterpolationPoint.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/detail/Sphere.hh b/include/ignition/math/detail/Sphere.hh deleted file mode 100644 index 70e5f8740..000000000 --- a/include/ignition/math/detail/Sphere.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2018 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/detail/WellOrderedVector.hh b/include/ignition/math/detail/WellOrderedVector.hh deleted file mode 100644 index 2c3eebed5..000000000 --- a/include/ignition/math/detail/WellOrderedVector.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2021 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/graph/Edge.hh b/include/ignition/math/graph/Edge.hh deleted file mode 100644 index 9a36fadd7..000000000 --- a/include/ignition/math/graph/Edge.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/graph/Graph.hh b/include/ignition/math/graph/Graph.hh deleted file mode 100644 index cae7123d7..000000000 --- a/include/ignition/math/graph/Graph.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/graph/GraphAlgorithms.hh b/include/ignition/math/graph/GraphAlgorithms.hh deleted file mode 100644 index beb36fea4..000000000 --- a/include/ignition/math/graph/GraphAlgorithms.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/include/ignition/math/graph/Vertex.hh b/include/ignition/math/graph/Vertex.hh deleted file mode 100644 index f1e2f7d45..000000000 --- a/include/ignition/math/graph/Vertex.hh +++ /dev/null @@ -1,19 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * - */ - -#include -#include diff --git a/src/Helpers.i b/src/Helpers.i index b49db4893..a15cc5584 100644 --- a/src/Helpers.i +++ b/src/Helpers.i @@ -28,10 +28,6 @@ template constexpr T GZ_MASSMATRIX3_DEFAULT_TOLERANCE = T(10); -// TODO(CH3): Deprecated. Remove on tock. -template -constexpr T IGN_MASSMATRIX3_DEFAULT_TOLERANCE = T(10); - #define GZ_PI 3.14159265358979323846 #define GZ_PI_2 1.57079632679489661923 #define GZ_PI_4 0.78539816339744830962 @@ -42,18 +38,6 @@ constexpr T IGN_MASSMATRIX3_DEFAULT_TOLERANCE = T(10); #define GZ_BOX_VOLUME(_x, _y, _z) (_x *_y * _z) #define GZ_BOX_VOLUME_V(_v) (_v.X() *_v.Y() * _v.Z()) -// TODO(CH3): Deprecated. Remove on tock. -#define IGN_PI GZ_PI -#define IGN_PI_2 GZ_PI_2 -#define IGN_PI_4 GZ_PI_4 -#define IGN_SQRT2 GZ_SQRT2 - -// TODO(CH3): Deprecated. Remove on tock. -#define IGN_SPHERE_VOLUME(_radius) GZ_SPHERE_VOLUME(_radius) -#define IGN_CYLINDER_VOLUME(_r, _l) GZ_CYLINDER_VOLUME(_r, _l) -#define IGN_BOX_VOLUME(_x, _y, _z) GZ_BOX_VOLUME(_x, _y, _z) -#define IGN_BOX_VOLUME_V(_v) GZ_BOX_VOLUME_V(_v) - namespace gz { namespace math @@ -69,18 +53,6 @@ namespace gz static const size_t GZ_EIGHT_SIZE_T = 8u; static const size_t GZ_NINE_SIZE_T = 9u; - // TODO(CH3): Deprecated. Remove on tock. - constexpr auto GZ_DEPRECATED(7) IGN_ZERO_SIZE_T = &GZ_ZERO_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_ONE_SIZE_T = &GZ_ONE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_TWO_SIZE_T = &GZ_TWO_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_THREE_SIZE_T = &GZ_THREE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_FOUR_SIZE_T = &GZ_FOUR_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_FIVE_SIZE_T = &GZ_FIVE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_SIX_SIZE_T = &GZ_SIX_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_SEVEN_SIZE_T = &GZ_SEVEN_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_EIGHT_SIZE_T = &GZ_EIGHT_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_NINE_SIZE_T = &GZ_NINE_SIZE_T; - static const double MAX_D = std::numeric_limits::max(); static const double MIN_D = std::numeric_limits::min(); static const double LOW_D = std::numeric_limits::lowest(); diff --git a/src/python_pybind11/src/Helpers.cc b/src/python_pybind11/src/Helpers.cc index 0b27070f5..d012d0a60 100644 --- a/src/python_pybind11/src/Helpers.cc +++ b/src/python_pybind11/src/Helpers.cc @@ -68,39 +68,6 @@ float BoxVolumeV(const gz::math::Vector3d &_v) return GZ_BOX_VOLUME_V(_v); } -// TODO(CH3): Deprecated. Remove on tock. -float SphereVolumeDeprecated(const float _radius) -{ - std::cerr << "ign_sphere_volume is deprecated. " - << "Please use gz_sphere_volume instead" - << std::endl; - return SphereVolume(_radius); -} - -float CylinderVolumeDeprecated(const float _r, const float _l) -{ - std::cerr << "ign_cylinder_volume is deprecated. " - << "Please use gz_cylinder_volume instead" - << std::endl; - return CylinderVolume(_r, _l); -} - -float BoxVolumeDeprecated(const float _x, const float _y, const float _z) -{ - std::cerr << "ign_box_volume is deprecated. " - << "Please use gz_box_volume instead" - << std::endl; - return BoxVolume(_x, _y, _z); -} - -float BoxVolumeVDeprecated(const gz::math::Vector3d &_v) -{ - std::cerr << "ign_box_volume_v is deprecated. " - << "Please use gz_box_volume_v instead" - << std::endl; - return BoxVolumeV(_v); -} - /// \brief Sort two numbers, such that _a <= _b /// \param[out] _a the first number /// \param[out] _b the second number @@ -213,21 +180,7 @@ void defineMathHelpers(py::module &m) "Compute box volume") .def("gz_box_volume_v", &BoxVolumeV, - "Compute box volume from vector") - - // TODO(CH3): Deprecated. Remove on tock. - .def("ign_sphere_volume", - &SphereVolumeDeprecated, - "[Deprecated] Compute sphere volume") - .def("ign_cylinder_volume", - &CylinderVolumeDeprecated, - "[Deprecated] Compute cylinder volume") - .def("ign_box_volume", - &BoxVolumeDeprecated, - "[Deprecated] Compute box volume") - .def("ign_box_volume_v", - &BoxVolumeVDeprecated, - "[Deprecated] Compute box volume from vector"); + "Compute box volume from vector"); py::class_(m, "Helpers", @@ -243,19 +196,6 @@ void defineMathHelpers(py::module &m) .def_readonly_static("GZ_SEVEN_SIZE_T", &GZ_SEVEN_SIZE_T) .def_readonly_static("GZ_EIGHT_SIZE_T", &GZ_EIGHT_SIZE_T) .def_readonly_static("GZ_NINE_SIZE_T", &GZ_NINE_SIZE_T) - - // TODO(CH3): Deprecated. Remove on tock. - .def_readonly_static("IGNZEROSIZET", &GZ_ZERO_SIZE_T, "GZ_PI") - .def_readonly_static("IGN_ONE_SIZE_T", &GZ_ONE_SIZE_T) - .def_readonly_static("IGN_TWO_SIZE_T", &GZ_TWO_SIZE_T) - .def_readonly_static("IGN_THREE_SIZE_T", &GZ_THREE_SIZE_T) - .def_readonly_static("IGN_FOUR_SIZE_T", &GZ_FOUR_SIZE_T) - .def_readonly_static("IGN_FIVE_SIZE_T", &GZ_FIVE_SIZE_T) - .def_readonly_static("IGN_SIX_SIZE_T", &GZ_SIX_SIZE_T) - .def_readonly_static("IGN_SEVEN_SIZE_T", &GZ_SEVEN_SIZE_T) - .def_readonly_static("IGN_EIGHT_SIZE_T", &GZ_EIGHT_SIZE_T) - .def_readonly_static("IGN_NINE_SIZE_T", &GZ_NINE_SIZE_T) - .def_readonly_static("MAX_D", &MAX_D) .def_readonly_static("MIN_D", &MIN_D) .def_readonly_static("LOW_D", &LOW_D) diff --git a/src/ruby/Helpers.i b/src/ruby/Helpers.i index 8abbb6567..1921334f1 100644 --- a/src/ruby/Helpers.i +++ b/src/ruby/Helpers.i @@ -37,12 +37,6 @@ #define GZ_SQRT2 1.41421356237309504880 #endif -// TODO(CH3): Deprecated. Remove on tock. -#define IGN_PI GZ_PI -#define IGN_PI_2 GZ_PI_2 -#define IGN_PI_4 GZ_PI_4 -#define IGN_SQRT2 GZ_SQRT2 - // The uppercase functions in the pythoncode block are defined with `#define` in cpp // but in python this may generate some issues. A workaround is to create a Python function. // With sort functions the issue is with the referenced arguments of a templated function, @@ -62,22 +56,6 @@ def gz_box_volume(_x, _y, _z): def gz_box_volume_v(_v): return (_v.x() *_v.y() * _v.z()) -# TODO(CH3): Deprecated. Remove on tock. -def ign_sphere_volume(_radius): - return gz_sphere_volume(_radius) - -# TODO(CH3): Deprecated. Remove on tock. -def ign_cylinder_volume(_r, _l): - return gz_cylinder_volume(_r, _l) - -# TODO(CH3): Deprecated. Remove on tock. -def ign_box_volume(_x, _y, _z): - return gz_box_volume(_x, _y, _z) - -# TODO(CH3): Deprecated. Remove on tock. -def ign_box_volume_v(_v): - return gz_box_volume_v(_v) - def sort2(_a, _b): def swap(s1, s2): return s2, s1 @@ -203,18 +181,6 @@ namespace gz static const size_t GZ_NINE_SIZE_T = 9u; - // TODO(CH3): Deprecated. Remove on tock. - constexpr auto GZ_DEPRECATED(7) IGN_ZERO_SIZE_T = &GZ_ZERO_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_ONE_SIZE_T = &GZ_ONE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_TWO_SIZE_T = &GZ_TWO_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_THREE_SIZE_T = &GZ_THREE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_FOUR_SIZE_T = &GZ_FOUR_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_FIVE_SIZE_T = &GZ_FIVE_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_SIX_SIZE_T = &GZ_SIX_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_SEVEN_SIZE_T = &GZ_SEVEN_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_EIGHT_SIZE_T = &GZ_EIGHT_SIZE_T; - constexpr auto GZ_DEPRECATED(7) IGN_NINE_SIZE_T = &GZ_NINE_SIZE_T; - static const double MAX_D = std::numeric_limits::max(); static const double MIN_D = std::numeric_limits::min(); diff --git a/test/integration/deprecated_TEST.cc b/test/integration/deprecated_TEST.cc deleted file mode 100644 index 91b7cd226..000000000 --- a/test/integration/deprecated_TEST.cc +++ /dev/null @@ -1,33 +0,0 @@ -/* - * Copyright (C) 2022 Open Source Robotics Foundation - * - * Licensed under the Apache License, Version 2.0 (the "License"); - * you may not use this file except in compliance with the License. - * You may obtain a copy of the License at - * - * http://www.apache.org/licenses/LICENSE-2.0 - * - * Unless required by applicable law or agreed to in writing, software - * distributed under the License is distributed on an "AS IS" BASIS, - * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied. - * See the License for the specific language governing permissions and - * limitations under the License. - * -*/ - -#include - -#define SUPPRESS_IGNITION_HEADER_DEPRECATION - -#include -#include - -///////////////////////////////////////////////// -// Make sure the ignition namespace still works -TEST(Deprecated, IgnitionNamespace) -{ - ignition::math::Angle angle; - (void) angle; -} - -#undef SUPPRESS_IGNITION_HEADER_DEPRECATION