Skip to content

Commit

Permalink
ign -> gz Partial Docs Migration and Project Name Followups : gz-math (
Browse files Browse the repository at this point in the history
  • Loading branch information
methylDragon authored Jun 28, 2022
1 parent 989ff9c commit 0919a13
Show file tree
Hide file tree
Showing 20 changed files with 51 additions and 45 deletions.
4 changes: 2 additions & 2 deletions Changelog.md
Original file line number Diff line number Diff line change
Expand Up @@ -546,7 +546,7 @@ instead.
`AxisAlignedBox` class.
* [BitBucket pull request 257](https://osrf-migration.github.io/ignition-gh-pages/#!/ignitionrobotics/ign-math/pull-requests/257)

1. Added eigen3 component with functions for converting between Eigen and ign-math types.
1. Added eigen3 component with functions for converting between Eigen and gz-math types.
* [BitBucket pull request 256](https://osrf-migration.github.io/ignition-gh-pages/#!/ignitionrobotics/ign-math/pull-requests/256)

1. Added a `MassMatrix3::SetFromCylinder` function that uses a `Material`
Expand Down Expand Up @@ -728,7 +728,7 @@ specify a density.
1. Added Color
* [BitBucket pull request 150](https://osrf-migration.github.io/ignition-gh-pages/#!/ignitionrobotics/ign-math/pull-requests/150)

1. Backport updated configure.bat to ign-math2 and fix cppcheck warnings
1. Backport updated configure.bat to gz-math2 and fix cppcheck warnings
* [BitBucket pull request 207](https://osrf-migration.github.io/ignition-gh-pages/#!/ignitionrobotics/ign-math/pull-requests/207)

### Gazebo Math 2.8
Expand Down
12 changes: 9 additions & 3 deletions Migration.md
Original file line number Diff line number Diff line change
Expand Up @@ -11,6 +11,12 @@ release will remove the deprecated code.

1. Removed the Quaternion integer template `Quaternioni`.

1. The project name has been changed to use the `gz-` prefix, you **must** use the `gz` prefix!
* This also means that any generated code that use the project name (e.g. CMake variables, in-source macros) would have to be migrated.
* Some non-exhaustive examples of this include:
* `GZ_<PROJECT>_<VISIBLE/HIDDEN>`
* CMake `-config` files
* Paths that depend on the project name

### Deprecations

Expand Down Expand Up @@ -149,9 +155,9 @@ release will remove the deprecated code.

### Added dependencies

1. **ignition-cmake**
+ Ignition-math now has a build dependency on ignition-cmake, which
allows cmake scripts to be shared across all the ignition packages.
1. **gz-cmake**
+ gz-math now has a build dependency on gz-cmake, which
allows cmake scripts to be shared across all the Gazebo packages.

### Modifications

Expand Down
6 changes: 3 additions & 3 deletions README.md
Original file line number Diff line number Diff line change
Expand Up @@ -14,8 +14,8 @@ Ubuntu Focal | [![Build Status](https://build.osrfoundation.org/buildStatus/ico
Homebrew | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_math-ci-ign-math7-homebrew-amd64)](https://build.osrfoundation.org/job/ignition_math-ci-ign-math7-homebrew-amd64)
Windows | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ign_math-ign-7-win)](https://build.osrfoundation.org/job/ign_math-ign-7-win)

Gazebo Math, a component of [Ignition
Robotics](https://gazebosim.org), provides general purpose math
Gazebo Math, a component of [Gazebo
Sim](https://gazebosim.org), provides general purpose math
classes and functions designed for robotic applications.

# Table of Contents
Expand Down Expand Up @@ -43,7 +43,7 @@ Gazebo Math provides a wide range of functionality, including:
* Type-templated pose, matrix, vector, and quaternion classes.
* Shape representations along with operators to compute volume, density, size and other properties.
* Classes for material properties, mass, inertial, temperature, [PID](https://en.wikipedia.org/wiki/PID_controller), kmeans, spherical coordinates, and filtering.
* Optional Eigen component that converts between a few Eigen and Ignition
* Optional Eigen component that converts between a few Eigen and Gazebo
Math types.

# Install
Expand Down
4 changes: 2 additions & 2 deletions api.md.in
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
## Ignition @IGN_DESIGNATION_CAP@
## Gazebo @IGN_DESIGNATION_CAP@

Ignition @IGN_DESIGNATION_CAP@ is a component in Gazebo, a set of
Gazebo @IGN_DESIGNATION_CAP@ is a component in Gazebo, a set of
libraries designed to rapidly develop robot and simulation applications.
This library defines a general set of math classes and functions with an eye
toward simulation and robotics.
Expand Down
2 changes: 1 addition & 1 deletion configure.bat
Original file line number Diff line number Diff line change
Expand Up @@ -4,7 +4,7 @@

:: Install dependencies
call %win_lib% :download_unzip_install eigen3-3.3.4.zip
call %win_lib% :install_ign_project ign-cmake ign-cmake3
call %win_lib% :install_ign_project gz-cmake gz-cmake3

:: Set configuration variables
@set build_type=Release
Expand Down
2 changes: 1 addition & 1 deletion examples/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@ cmake_minimum_required(VERSION 3.5 FATAL_ERROR)

project(gz-math-examples)

# Find the Ignition-Math library
# Find the Gazebo Math library
find_package(gz-math7 REQUIRED)
set(GZ_MATH_VER ${gz-math7_VERSION_MAJOR})

Expand Down
2 changes: 1 addition & 1 deletion examples/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -25,7 +25,7 @@ Build on Unix:
make
```

To build on Windows, make sure the configuration matches `ign-math`'s
To build on Windows, make sure the configuration matches `gz-math`'s
configuration:

```
Expand Down
2 changes: 1 addition & 1 deletion src/Helpers_TEST.cc
Original file line number Diff line number Diff line change
Expand Up @@ -986,7 +986,7 @@ TEST(HelpersTest, AppendToStream)
std::ostringstream out;

GZ_UTILS_WARN_IGNORE__DEPRECATED_DECLARATION
// Deprecated in ign-math7
// Deprecated in gz-math7
math::appendToStream(out, 0.12345678, 3);
EXPECT_EQ(out.str(), "0.123");

Expand Down
4 changes: 2 additions & 2 deletions src/Quaternion_TEST.cc
Original file line number Diff line number Diff line change
Expand Up @@ -326,11 +326,11 @@ TEST(QuaternionTest, MathAxis)
math::Quaterniond q(GZ_PI*0.1, GZ_PI*0.5, GZ_PI);

GZ_UTILS_WARN_IGNORE__DEPRECATED_DECLARATION
// Deprecated in ign-math7
// Deprecated in gz-math7
q.Axis(0, 1, 0, GZ_PI);
EXPECT_EQ(q, math::Quaterniond(6.12303e-17, 0, 1, 0));

// Deprecated in ign-math7
// Deprecated in gz-math7
q.Axis(1, 0, 0, GZ_PI);
EXPECT_EQ(q, math::Quaterniond(0, 1, 0, 0));
GZ_UTILS_WARN_RESUME__DEPRECATED_DECLARATION
Expand Down
4 changes: 2 additions & 2 deletions tutorials.md.in
Original file line number Diff line number Diff line change
@@ -1,8 +1,8 @@
\page tutorials Tutorials

Welcome to the Ignition @IGN_DESIGNATION_CAP@ tutorials. These tutorials
Welcome to the Gazebo @IGN_DESIGNATION_CAP@ tutorials. These tutorials
will guide you through the process of understanding the capabilities of the
Ignition @IGN_DESIGNATION_CAP@ library and how to use the library effectively.
Gazebo @IGN_DESIGNATION_CAP@ library and how to use the library effectively.


**The tutorials**
Expand Down
4 changes: 2 additions & 2 deletions tutorials/angle.md
Original file line number Diff line number Diff line change
Expand Up @@ -6,11 +6,11 @@ This tutorial explains how to use the `Angle` class from Gazebo Math library.

### Compile the code

Go to `ign-math/examples` and use `cmake` to compile the code:
Go to `gz-math/examples` and use `cmake` to compile the code:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b main
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down
4 changes: 2 additions & 2 deletions tutorials/color.md
Original file line number Diff line number Diff line change
Expand Up @@ -4,11 +4,11 @@ This tutorial explains how to use the `Color` class from Gazebo Math library.

## Compile the code

Go to `ign-math/examples` and use `cmake` to compile the code:
Go to `gz-math/examples` and use `cmake` to compile the code:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b ign-math7
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down
4 changes: 2 additions & 2 deletions tutorials/example_angle.md
Original file line number Diff line number Diff line change
Expand Up @@ -6,11 +6,11 @@ This tutorial explains how to use the `Angle` class from Gazebo Math library.

### Compile the code

Go to `ign-math/examples` and use `cmake` to compile the code:
Go to `gz-math/examples` and use `cmake` to compile the code:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b master
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down
4 changes: 2 additions & 2 deletions tutorials/example_triangle.md
Original file line number Diff line number Diff line change
Expand Up @@ -4,11 +4,11 @@ This tutorial explains how to use the `Triangle` class from Gazebo Math library.

## Compile the code

Go to `ign-math/examples` and use `cmake` to compile the code:
Go to `gz-math/examples` and use `cmake` to compile the code:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b master
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down
4 changes: 2 additions & 2 deletions tutorials/example_vector2.md
Original file line number Diff line number Diff line change
Expand Up @@ -6,11 +6,11 @@ This tutorial explains how to use the `Vector` class from Gazebo Math library.

### Compile the code

To compile the code, go to `ign-math/examples` and use `cmake`:
To compile the code, go to `gz-math/examples` and use `cmake`:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b master
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down
18 changes: 9 additions & 9 deletions tutorials/installation.md
Original file line number Diff line number Diff line change
Expand Up @@ -3,7 +3,7 @@
Next Tutorial: \ref cppgetstarted

These instructions are for installing only Gazebo Math.
If you're interested in using all the Ignition libraries, check out this [Ignition installation](https://gazebosim.org/docs/latest/install).
If you're interested in using all the Gazebo libraries, check out this [Gazebo installation](https://gazebosim.org/docs/latest/install).

We recommend following the Binary Installation instructions to get up and running as quickly and painlessly as possible.

Expand Down Expand Up @@ -55,8 +55,8 @@ Miniconda suffices.

Create if necessary, and activate a Conda environment:
```
conda create -n ign-ws
conda activate ign-ws
conda create -n gz-ws
conda activate gz-ws
```

Install:
Expand Down Expand Up @@ -101,7 +101,7 @@ The optional Ruby tests of Gazebo Math require:

### Windows 10

First, follow the [ign-cmake](https://github.com/gazebosim/gz-cmake) tutorial for installing Conda, Visual Studio, CMake, and other prerequisites, and also for creating a Conda environment.
First, follow the [gz-cmake](https://github.com/gazebosim/gz-cmake) tutorial for installing Conda, Visual Studio, CMake, and other prerequisites, and also for creating a Conda environment.

The optional Eigen component of Gazebo Math requires:

Expand Down Expand Up @@ -134,7 +134,7 @@ The optional Eigen component of Gazebo Math requires:

4. Configure and build
```
cd ign-math
cd gz-math
mkdir build
cd build
cmake ..
Expand Down Expand Up @@ -164,7 +164,7 @@ The optional Eigen component of Gazebo Math requires:

3. Configure and build
```
cd ign-math
cd gz-math
mkdir build
cd build
cmake ..
Expand All @@ -181,7 +181,7 @@ The optional Eigen component of Gazebo Math requires:
1. Navigate to `condabin` if necessary to use the `conda` command (i.e., if Conda is not in your `PATH` environment variable. You can find the location of `condabin` in Anaconda Prompt, `where conda`).
Activate the Conda environment created in the prerequisites:
```
conda activate ign-ws
conda activate gz-ws
```

2. Install dependencies
Expand All @@ -205,7 +205,7 @@ The optional Eigen component of Gazebo Math requires:

4. Configure and build
```
cd ign-math
cd gz-math
mkdir build
cd build
cmake .. -DBUILD_TESTING=OFF # Optionally, -DCMAKE_INSTALL_PREFIX=path\to\install
Expand Down Expand Up @@ -235,7 +235,7 @@ You can also generate the documentation from a clone of this repository by follo

3. Configure and build the documentation.
```
cd ign-math; mkdir build; cd build; cmake ../; make doc
cd gz-math; mkdir build; cd build; cmake ../; make doc
```

4. View the documentation by running the following command from the build directory.
Expand Down
4 changes: 2 additions & 2 deletions tutorials/rotation.md
Original file line number Diff line number Diff line change
Expand Up @@ -4,11 +4,11 @@ This example explains how to use quaternions and euler angles, and how to conver

## Compiling and running the code

Go to `ign-math/examples` and use `cmake` to compile the code:
Go to `gz-math/examples` and use `cmake` to compile the code:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b main
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down
4 changes: 2 additions & 2 deletions tutorials/rotation_example.md
Original file line number Diff line number Diff line change
Expand Up @@ -4,11 +4,11 @@ This example explains how to use quaternions and euler angles, and how to conver

## Compiling and running the code

Go to `ign-math/examples` and use `cmake` to compile the code:
Go to `gz-math/examples` and use `cmake` to compile the code:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b master
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down
4 changes: 2 additions & 2 deletions tutorials/triangle.md
Original file line number Diff line number Diff line change
Expand Up @@ -4,11 +4,11 @@ This tutorial explains how to use the `Triangle` class from Gazebo Math library.

## Compile the code

Go to `ign-math/examples` and use `cmake` to compile the code:
Go to `gz-math/examples` and use `cmake` to compile the code:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b main
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down
4 changes: 2 additions & 2 deletions tutorials/vector.md
Original file line number Diff line number Diff line change
Expand Up @@ -6,11 +6,11 @@ This tutorial explains how to use the `Vector` classes from Gazebo Math library.

### Compile the code

To compile the code, go to `ign-math/examples` and use `cmake`:
To compile the code, go to `gz-math/examples` and use `cmake`:

```{.sh}
git clone https://github.com/gazebosim/gz-math/ -b main
cd ign-math/examples
cd gz-math/examples
mkdir build
cd build
cmake ..
Expand Down

0 comments on commit 0919a13

Please sign in to comment.