Skip to content

Commit

Permalink
ignitionrobotics -> gazebosim and Ignition Robotics -> Gazebo
Browse files Browse the repository at this point in the history
Signed-off-by: methylDragon <[email protected]>
  • Loading branch information
methylDragon committed May 23, 2022
1 parent 2e63c36 commit 373dfdd
Show file tree
Hide file tree
Showing 21 changed files with 374 additions and 374 deletions.
2 changes: 1 addition & 1 deletion .github/ci/before_cmake.sh
Original file line number Diff line number Diff line change
Expand Up @@ -7,7 +7,7 @@ BUILD_DIR=`pwd`
cd /tmp

# check that we can compile USD from sources (only Focal)
# see https://github.com/ignitionrobotics/sdformat/issues/869
# see https://github.com/gazebosim/sdformat/issues/869
return_code=0
if [ "$(lsb_release -r -s)" != "20.04" ]; then
return_code=$(($return_code + 1))
Expand Down
2 changes: 1 addition & 1 deletion CODE_OF_CONDUCT.md
Original file line number Diff line number Diff line change
Expand Up @@ -56,7 +56,7 @@ further defined and clarified by project maintainers.
## Enforcement

Instances of abusive, harassing, or otherwise unacceptable behavior may be
reported by contacting the project team at [https://ignitionrobotics.org/support](https://ignitionrobotics.org/support). All
reported by contacting the project team at [https://gazebosim.org/support](https://gazebosim.org/support). All
complaints will be reviewed and investigated and will result in a response that
is deemed necessary and appropriate to the circumstances. The project team is
obligated to maintain confidentiality with regard to the reporter of an incident.
Expand Down
2 changes: 1 addition & 1 deletion CONTRIBUTING.md
Original file line number Diff line number Diff line change
@@ -1,3 +1,3 @@
See the
[Ignition Robotics contributing guide](https://ignitionrobotics.org/docs/all/contributing)
[Gazebo contributing guide](https://gazebosim.org/docs/all/contributing)
for how to contribute to SDFormat.
646 changes: 323 additions & 323 deletions Changelog.md

Large diffs are not rendered by default.

16 changes: 8 additions & 8 deletions Migration.md
Original file line number Diff line number Diff line change
Expand Up @@ -493,33 +493,33 @@ ABI was broken for `sdf::Element`, and restored on version 11.2.1.
1. **camera.sdf**: New elements to configure segmentation and boundingbox cameras
+ `//sensor/camera/segmentation_type`
+ `//sensor/camera/box_type`
+ [Pull request #592](https://github.com/ignitionrobotics/sdformat/pull/592)
+ [Pull request #592](https://github.com/gazebosim/sdformat/pull/592)

1. **forcetorque.sdf**: New elements to specify the noise characteristics of the force-torque sensor
+ `//sensor/force_torque/force`
+ `//sensor/force_torque/torque`
+ [Pull request #669](https://github.com/ignitionrobotics/sdformat/pull/669)
+ [Pull request #669](https://github.com/gazebosim/sdformat/pull/669)

1. **model.sdf**: `//model/include/@merge` for merging included nested models into the containing model
+ [Pull request #659](https://github.com/ignitionrobotics/sdformat/pull/659)
+ [Pull request #659](https://github.com/gazebosim/sdformat/pull/659)

1. **pose.sdf**: New attributes to support specifying angles in degrees and specifying rotations in quaternions
+ `//pose/@rotation_format`
+ `//pose/@degrees`
+ [Pull request #690](https://github.com/ignitionrobotics/sdformat/pull/690)
+ [Pull request #589](https://github.com/ignitionrobotics/sdformat/pull/589)
+ [Pull request #690](https://github.com/gazebosim/sdformat/pull/690)
+ [Pull request #589](https://github.com/gazebosim/sdformat/pull/589)

1. **sensor.sdf**: New sensor types `boundingbox_camera`, `segmentation_camera`, and `custom`.
+ [Pull request #592](https://github.com/ignitionrobotics/sdformat/pull/592)
+ [Pull request #592](https://github.com/gazebosim/sdformat/pull/592)

### Removals

1. **joint.sdf**
+ Deprecated elements `//joint/axis/initial_position` and `//joint/axis2/initial_position` have been removed
* [Pull request #622](https://github.com/ignitionrobotics/sdformat/pull/622)
* [Pull request #622](https://github.com/gazebosim/sdformat/pull/622)

1. **spherical_coordinates**: Unsupported options `NED` and `NWU` have been removed from `//spherical_coordinates/world_frame_orientation`
* [Pull request #685](https://github.com/ignitionrobotics/sdformat/pull/685)
* [Pull request #685](https://github.com/gazebosim/sdformat/pull/685)

## SDFormat specification 1.7 to 1.8

Expand Down
4 changes: 2 additions & 2 deletions README.md
Original file line number Diff line number Diff line change
Expand Up @@ -32,7 +32,7 @@ TODO(eric.cousineau): Move terminology section to sdf_tutorials?
## Test coverage

<!-- Note: The branch name in the codecov URL should be updated when forward porting -->
[![codecov](https://codecov.io/gh/ignitionrobotics/sdformat/branch/main/graph/badge.svg)](https://codecov.io/gh/ignitionrobotics/sdformat/branch/main)
[![codecov](https://codecov.io/gh/gazebosim/sdformat/branch/main/graph/badge.svg)](https://codecov.io/gh/gazebosim/sdformat/branch/main)

# Installation

Expand Down Expand Up @@ -143,7 +143,7 @@ make uninstall

Clone the repository
```sh
git clone https://github.com/ignitionrobotics/sdformat -b sdf<#>
git clone https://github.com/gazebosim/sdformat -b sdf<#>
```
Be sure to replace `<#>` with a number value, such as 1 or 2, depending on
which version you need.
Expand Down
2 changes: 1 addition & 1 deletion doc/header.html
Original file line number Diff line number Diff line change
Expand Up @@ -41,7 +41,7 @@ <h2 style="text-align:center;">
<dd><a href="http://sdf.com/wiki/Tutorials">Tutorials</a></dd>
<dd><a href="http://sdf.com/downloads.html">Download</a></dd>
-->
<dd><a href="https://github.com/ignitionrobotics/sdformat/issues/new">Report Documentation Issues</a></dd>
<dd><a href="https://github.com/gazebosim/sdformat/issues/new">Report Documentation Issues</a></dd>
</dl>
</div>
<div>
Expand Down
2 changes: 1 addition & 1 deletion doc/mainpage.html
Original file line number Diff line number Diff line change
Expand Up @@ -5,7 +5,7 @@
Desctiption Format API. The code reference is divided into the groups below.
Should you find problems with this documentation - typos, unclear phrases,
or insufficient detail - please create a <a
href="https://github.com/ignitionrobotics/sdformat/issues/new">new GitHub issue</a>.
href="https://github.com/gazebosim/sdformat/issues/new">new GitHub issue</a>.
Include sufficient detail to quickly locate the problematic documentation,
and set the issue's fields accordingly: Assignee - blank; Kind - bug;
Priority - minor; Version - blank.
Expand Down
2 changes: 1 addition & 1 deletion examples/python/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -3,7 +3,7 @@
This example shows how to use sdformat's Python API.

In the
[examples/python](https://github.com/ignitionrobotics/sdformat/blob/main/examples/python)
[examples/python](https://github.com/gazebosim/sdformat/blob/main/examples/python)
folder there is a Python script that shows how to make use of this API.

> If you compiled sdformat from source you should modify your `PYTHONPATH`:
Expand Down
10 changes: 5 additions & 5 deletions examples/usdConverter/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -6,15 +6,15 @@ This example shows how a world in a SDF file can be converted to [USD](https://g

You will need all of the dependencies for sdformat, along with the following additional dependencies:
* USD: [installation instructions](https://github.com/PixarAnimationStudios/USD/blob/release/README.md#getting-and-building-the-code)
* [ignition-common5](https://github.com/ignitionrobotics/ign-common)
* [ignition-utils2 (including the CLI component)](https://github.com/ignitionrobotics/ign-utils)
* [ignition-common5](https://github.com/gazebosim/ign-common)
* [ignition-utils2 (including the CLI component)](https://github.com/gazebosim/ign-utils)

## Setup

Build sdformat. The steps below follow a traditional cmake build, but sdformat
can also be built with [colcon](https://colcon.readthedocs.io/en/released/index.html):
```bash
git clone https://github.com/ignitionrobotics/sdformat.git
git clone https://github.com/gazebosim/sdformat.git
cd sdformat
mkdir build
cd build
Expand All @@ -29,10 +29,10 @@ To see how the executable works, run the following command from the `sdformat/bu
./sdf2usd -h
```

To convert [shapes_world.sdf](https://github.com/ignitionrobotics/sdformat/blob/sdf12/test/sdf/shapes_world.sdf) to its USD representation as a file called `shapes.usd`, run the following commands:
To convert [shapes_world.sdf](https://github.com/gazebosim/sdformat/blob/sdf12/test/sdf/shapes_world.sdf) to its USD representation as a file called `shapes.usd`, run the following commands:

```bash
wget https://raw.githubusercontent.com/ignitionrobotics/sdformat/sdf12/test/sdf/shapes_world.sdf
wget https://raw.githubusercontent.com/gazebosim/sdformat/sdf12/test/sdf/shapes_world.sdf
./sdf2usd shapes_world.sdf shapes.usd
```

Expand Down
2 changes: 1 addition & 1 deletion include/sdf/Param.hh
Original file line number Diff line number Diff line change
Expand Up @@ -734,7 +734,7 @@ namespace sdf
{
// this section for handling bool types is to keep backward behavior
// TODO(anyone) remove for Fortress. For more details:
// https://github.com/ignitionrobotics/sdformat/pull/638
// https://github.com/gazebosim/sdformat/pull/638
valueStr = lowercase(valueStr);

std::stringstream tmp;
Expand Down
2 changes: 1 addition & 1 deletion python/test/pyModel_TEST.py
Original file line number Diff line number Diff line change
Expand Up @@ -247,7 +247,7 @@ def test_add_modify_frame(self):

def test_uri(self):
model = Model()
uri = "https:#fuel.ignitionrobotics.org/1.0/openrobotics/models/my-model"
uri = "https:#fuel.gazebosim.org/1.0/openrobotics/models/my-model"

model.set_uri(uri)
self.assertEqual(uri, model.uri())
Expand Down
2 changes: 1 addition & 1 deletion src/FrameSemantics.cc
Original file line number Diff line number Diff line change
Expand Up @@ -55,7 +55,7 @@ void printGraph(const ScopedGraph<FrameAttachedToGraph> &_graph)
// The following two functions were originally submitted to ign-math,
// but were not accepted as they were not generic enough.
// For now, they will be kept here.
// https://osrf-migration.github.io/ignition-gh-pages/#!/ignitionrobotics/ign-math/pull-requests/333
// https://osrf-migration.github.io/ignition-gh-pages/#!/gazebosim/ign-math/pull-requests/333

/// \brief Starting from a given vertex in a directed graph, traverse edges
/// in reverse direction to find a source vertex (has only outgoing edges).
Expand Down
2 changes: 1 addition & 1 deletion src/Model_TEST.cc
Original file line number Diff line number Diff line change
Expand Up @@ -417,7 +417,7 @@ TEST(DOMModel, Uri)
std::string name = "my-model";
gz::math::Pose3d pose(1, 2, 3, 0.1, 0.2, 0.3);
std::string uri =
"https://fuel.ignitionrobotics.org/1.0/openrobotics/models/my-model";
"https://fuel.gazebosim.org/1.0/openrobotics/models/my-model";

model.SetName(name);
model.SetRawPose(pose);
Expand Down
20 changes: 10 additions & 10 deletions test/integration/geometry_dom.cc
Original file line number Diff line number Diff line change
Expand Up @@ -179,7 +179,7 @@ TEST(DOMGeometry, Shapes)
EXPECT_EQ(sdf::GeometryType::MESH, meshCol->Geom()->Type());
const sdf::Mesh *meshColGeom = meshCol->Geom()->MeshShape();
ASSERT_NE(nullptr, meshColGeom);
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/mesh/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/mesh/"
"mesh.dae", meshColGeom->Uri());
EXPECT_TRUE(gz::math::Vector3d(0.1, 0.2, 0.3) ==
meshColGeom->Scale());
Expand All @@ -193,7 +193,7 @@ TEST(DOMGeometry, Shapes)
EXPECT_EQ(sdf::GeometryType::MESH, meshVis->Geom()->Type());
const sdf::Mesh *meshVisGeom = meshVis->Geom()->MeshShape();
ASSERT_NE(nullptr, meshVisGeom);
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/mesh"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/mesh"
"/mesh.dae", meshVisGeom->Uri());
EXPECT_TRUE(gz::math::Vector3d(1.2, 2.3, 3.4) ==
meshVisGeom->Scale());
Expand All @@ -207,7 +207,7 @@ TEST(DOMGeometry, Shapes)
EXPECT_EQ(sdf::GeometryType::HEIGHTMAP, heightmapCol->Geom()->Type());
auto heightmapColGeom = heightmapCol->Geom()->HeightmapShape();
ASSERT_NE(nullptr, heightmapColGeom);
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/"
"materials/textures/heightmap.png", heightmapColGeom->Uri());
EXPECT_EQ(gz::math::Vector3d(500, 500, 100), heightmapColGeom->Size());
EXPECT_EQ(gz::math::Vector3d(1, 2, 3), heightmapColGeom->Position());
Expand All @@ -221,31 +221,31 @@ TEST(DOMGeometry, Shapes)
EXPECT_EQ(sdf::GeometryType::HEIGHTMAP, heightmapVis->Geom()->Type());
auto heightmapVisGeom = heightmapVis->Geom()->HeightmapShape();
ASSERT_NE(nullptr, heightmapVisGeom);
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/"
"materials/textures/heightmap.png", heightmapVisGeom->Uri());
EXPECT_EQ(gz::math::Vector3d(500, 500, 100), heightmapVisGeom->Size());
EXPECT_EQ(gz::math::Vector3d(1, 2, 3), heightmapVisGeom->Position());
EXPECT_EQ(3u, heightmapVisGeom->TextureCount());
EXPECT_EQ(2u, heightmapVisGeom->BlendCount());

auto texture0 = heightmapVisGeom->TextureByIndex(0u);
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/"
"materials/textures/diffuse0.png", texture0->Diffuse());
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/"
"materials/textures/normal0.png", texture0->Normal());
EXPECT_DOUBLE_EQ(5.0, texture0->Size());

auto texture1 = heightmapVisGeom->TextureByIndex(1u);
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/"
"materials/textures/diffuse1.png", texture1->Diffuse());
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/"
"materials/textures/normal1.png", texture1->Normal());
EXPECT_DOUBLE_EQ(10.0, texture1->Size());

auto texture2 = heightmapVisGeom->TextureByIndex(2u);
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/"
"materials/textures/diffuse2.png", texture2->Diffuse());
EXPECT_EQ("https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/"
EXPECT_EQ("https://fuel.gazebosim.org/1.0/an_org/models/a_model/"
"materials/textures/normal2.png", texture2->Normal());
EXPECT_DOUBLE_EQ(20.0, texture2->Size());

Expand Down
4 changes: 2 additions & 2 deletions test/integration/print_config.cc
Original file line number Diff line number Diff line change
Expand Up @@ -153,7 +153,7 @@ R"(<model name='test2'>
/////////////////////////////////////////////////
// Test verifies preserving includes does not work for merge-includes.
// Need to update test if issue is addressed.
// https://github.com/ignitionrobotics/sdformat/issues/769
// https://github.com/gazebosim/sdformat/issues/769
TEST(PrintConfig, PreserveIncludesWithMerge)
{
const std::string modelPath = sdf::testing::TestFile("integration", "model");
Expand Down Expand Up @@ -192,7 +192,7 @@ R"(<model name="m2">

// The expected output pose string here still contains a -0 on the pitch value
// as it was set using gz::math::Pose3d::operator<<, this test will have
// to be modified when we start using ignitionrobotics/ign-math#206.
// to be modified when we start using gazebosim/ign-math#206.
const std::string expectedIncludeMerge =
R"(<model name='m2'>
<frame name='_merged__test_box2__model__' attached_to='link'>
Expand Down
20 changes: 10 additions & 10 deletions test/sdf/shapes.sdf
Original file line number Diff line number Diff line change
Expand Up @@ -121,7 +121,7 @@
<collision name="mesh_col">
<geometry>
<mesh>
<uri>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/mesh/mesh.dae</uri>
<uri>https://fuel.gazebosim.org/1.0/an_org/models/a_model/mesh/mesh.dae</uri>
<submesh>
<name>my_submesh</name>
<center>true</center>
Expand All @@ -134,7 +134,7 @@
<visual name="mesh_vis">
<geometry>
<mesh>
<uri>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/mesh/mesh.dae</uri>
<uri>https://fuel.gazebosim.org/1.0/an_org/models/a_model/mesh/mesh.dae</uri>
<submesh>
<name>another_submesh</name>
<center>false</center>
Expand All @@ -147,7 +147,7 @@
<collision name="heightmap_col">
<geometry>
<heightmap>
<uri>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/materials/textures/heightmap.png</uri>
<uri>https://fuel.gazebosim.org/1.0/an_org/models/a_model/materials/textures/heightmap.png</uri>
<size>500 500 100</size>
<pos>1 2 3</pos>
</heightmap>
Expand All @@ -157,30 +157,30 @@
<visual name="heightmap_vis">
<geometry>
<heightmap>
<uri>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/materials/textures/heightmap.png</uri>
<uri>https://fuel.gazebosim.org/1.0/an_org/models/a_model/materials/textures/heightmap.png</uri>
<size>500 500 100</size>
<pos>1 2 3</pos>
<texture>
<diffuse>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/materials/textures/diffuse0.png</diffuse>
<normal>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/materials/textures/normal0.png</normal>
<diffuse>https://fuel.gazebosim.org/1.0/an_org/models/a_model/materials/textures/diffuse0.png</diffuse>
<normal>https://fuel.gazebosim.org/1.0/an_org/models/a_model/materials/textures/normal0.png</normal>
<size>5</size>
</texture>
<blend>
<min_height>15</min_height>
<fade_dist>5</fade_dist>
</blend>
<texture>
<diffuse>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/materials/textures/diffuse1.png</diffuse>
<normal>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/materials/textures/normal1.png</normal>
<diffuse>https://fuel.gazebosim.org/1.0/an_org/models/a_model/materials/textures/diffuse1.png</diffuse>
<normal>https://fuel.gazebosim.org/1.0/an_org/models/a_model/materials/textures/normal1.png</normal>
<size>10</size>
</texture>
<blend>
<min_height>30</min_height>
<fade_dist>10</fade_dist>
</blend>
<texture>
<diffuse>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/materials/textures/diffuse2.png</diffuse>
<normal>https://fuel.ignitionrobotics.org/1.0/an_org/models/a_model/materials/textures/normal2.png</normal>
<diffuse>https://fuel.gazebosim.org/1.0/an_org/models/a_model/materials/textures/diffuse2.png</diffuse>
<normal>https://fuel.gazebosim.org/1.0/an_org/models/a_model/materials/textures/normal2.png</normal>
<size>20</size>
</texture>
</heightmap>
Expand Down
2 changes: 1 addition & 1 deletion usd/src/sdf_parser/Joint.cc
Original file line number Diff line number Diff line change
Expand Up @@ -352,7 +352,7 @@ namespace usd
// range, SDF does not have limits for a ball joint. So, there's
// nothing to do after creating a UsdPhysicsSphericalJoint, since this
// joint by default has no limits (i.e., allows for circular motion)
// related issue https://github.com/ignitionrobotics/sdformat/issues/860
// related issue https://github.com/gazebosim/sdformat/issues/860
pxr::UsdPhysicsSphericalJoint::Define(_stage, pxr::SdfPath(_path));
break;
case sdf::JointType::FIXED:
Expand Down
2 changes: 1 addition & 1 deletion usd/src/usd_parser/USDLinks.cc
Original file line number Diff line number Diff line change
Expand Up @@ -123,7 +123,7 @@ void GetInertial(

// TODO(ahcorde) Figure out how to use PrincipalMoments and
// PrincipalAxesOffset: see
// https://github.com/ignitionrobotics/sdformat/pull/902#discussion_r840905534
// https://github.com/gazebosim/sdformat/pull/902#discussion_r840905534
massMatrix.SetDiagonalMoments(
gz::math::Vector3d(
diagonalInertia[0],
Expand Down
2 changes: 1 addition & 1 deletion usd/src/usd_parser/USDTransforms.cc
Original file line number Diff line number Diff line change
Expand Up @@ -256,7 +256,7 @@ UDSTransforms ParseUSDTransform(const pxr::UsdPrim &_prim)

// TODO(ahcorde) This part should be reviewed, revisit how rotateXYZ
// and rotateZYX are handle.
// Related issue https://github.com/ignitionrobotics/sdformat/issues/926
// Related issue https://github.com/gazebosim/sdformat/issues/926
// if (op == kXFormOpRotateZYX)
// {
// std::swap(angleX, angleZ);
Expand Down
2 changes: 1 addition & 1 deletion usd/src/usd_parser/USDWorld.cc
Original file line number Diff line number Diff line change
Expand Up @@ -154,7 +154,7 @@ namespace usd
// This conversion might only work with Issac Sim USDs
// TODO(adlarkin) find a better way to get root model prims/parent prims
// of lights attached to the stage: see
// https://github.com/ignitionrobotics/sdformat/issues/927
// https://github.com/gazebosim/sdformat/issues/927
if (primPathTokens.size() >= 2)
{
bool shortName = false;
Expand Down

0 comments on commit 373dfdd

Please sign in to comment.