Skip to content

Commit

Permalink
Ignition -> Gazebo (#245)
Browse files Browse the repository at this point in the history
Signed-off-by: Jenn Nguyen <jenn@openrobotics.org>
  • Loading branch information
jennuine authored Jul 15, 2022
1 parent 1eb8a63 commit a82550d
Showing 1 changed file with 24 additions and 25 deletions.
49 changes: 24 additions & 25 deletions README.md
Original file line number Diff line number Diff line change
@@ -1,22 +1,21 @@
# Ignition Sensors : Sensor models for simulation
# Gazebo Sensors : Sensor models for simulation

**Maintainer:** nate AT openrobotics DOT org

[![GitHub open issues](https://img.shields.io/github/issues-raw/ignitionrobotics/ign-sensors.svg)](https://github.com/ignitionrobotics/ign-sensors/issues)
[![GitHub open pull requests](https://img.shields.io/github/issues-pr-raw/ignitionrobotics/ign-sensors.svg)](https://github.com/ignitionrobotics/ign-sensors/pulls)
[![GitHub open issues](https://img.shields.io/github/issues-raw/gazebosim/gz-sensors.svg)](https://github.com/gazebosim/gz-sensors/issues)
[![GitHub open pull requests](https://img.shields.io/github/issues-pr-raw/gazebosim/gz-sensors.svg)](https://github.com/gazebosim/gz-sensors/pulls)
[![Discourse topics](https://img.shields.io/discourse/https/community.gazebosim.org/topics.svg)](https://community.gazebosim.org)
[![Hex.pm](https://img.shields.io/hexpm/l/plug.svg)](https://www.apache.org/licenses/LICENSE-2.0)

Build | Status
-- | --
Test coverage | [![codecov](https://codecov.io/gh/ignitionrobotics/ign-sensors/branch/ign-sensors3/graph/badge.svg)](https://codecov.io/gh/ignitionrobotics/ign-sensors)
Ubuntu Bionic | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_sensors-ci-ign-sensors3-bionic-amd64)](https://build.osrfoundation.org/job/ignition_sensors-ci-ign-sensors3-bionic-amd64)
Test coverage | [![codecov](https://codecov.io/gh/gazebosim/gz-sensors/branch/ign-sensors3/graph/badge.svg)](https://codecov.io/gh/gazebosim/gz-sensors/branch/ign-sensors3)
Ubuntu Focal | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_sensors-ci-ign-sensors3-focal-amd64)](https://build.osrfoundation.org/job/ignition_sensors-ci-ign-sensors3-focal-amd64)
Homebrew | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_sensors-ci-ign-sensors3-homebrew-amd64)](https://build.osrfoundation.org/job/ignition_sensors-ci-ign-sensors3-homebrew-amd64)
Windows | [![Build Status](https://build.osrfoundation.org/job/ign_sensors-ign-3-win/badge/icon)](https://build.osrfoundation.org/job/ign_sensors-ign-3-win/)

Ignition Sensors, a component of [Ignition
Robotics](https://ignitionrobotics.org), provides numerous sensor models
designed to generate realistic data from simulation environments. Ignition Sensors is used in conjunction with [Ignition Libraries](https://ignitionrobotics/libs), and especially relies on the rendering capabilities from [Ignition Rendering](https://ignitionrobotics.org/libs/rendering) and physics simulation from [Ignition Physics](https://ignitionrobotics.org/libs/physics).
Gazebo Sensors, a component of [Gazebo](https://gazebosim.org), provides numerous sensor models
designed to generate realistic data from simulation environments. Gazebo Sensors is used in conjunction with [Gazebo Libraries](https://gazebosim/libs), and especially relies on the rendering capabilities from [Gazebo Rendering](https://gazebosim.org/libs/rendering) and physics simulation from [Gazebo Physics](https://gazebosim.org/libs/physics).

# Table of Contents

Expand Down Expand Up @@ -46,7 +45,7 @@ designed to generate realistic data from simulation environments. Ignition Senso

# Features

Ignition Sensors provides a set of sensors models that can be
Gazebo Sensors provides a set of sensors models that can be
configured at run time to mimic specific real-world sensors. A noise model
is also provided that can be used to introduce Gaussian or custom noise
models into sensor streams.
Expand Down Expand Up @@ -86,7 +85,7 @@ sudo apt install libignition-sensors-dev
```

At the time of this writing, there is only one released version of
ignition-sensors. It's possible that additional versions have been released,
Gazebo Sensors. It's possible that additional versions have been released,
in which case you can use add a numeral (2, 3, etc) to install a different
version. For example, to install version 2:

Expand All @@ -101,15 +100,15 @@ necessary prerequisites followed by building from source.

### Prerequisites

Ignition Sensors requires:
Gazebo Sensors requires:

* [Ubuntu Bionic](http://releases.ubuntu.com/18.04/)
* [Ignition CMake](https://ignitionrobotics.org/libs/cmake)
* [Ignition Math](https://ignitionrobotics.org/libs/math)
* [Ignition Common](https://ignitionrobotics.org/libs/common)
* [Ignition Transport](https://ignitionrobotics.org/libs/transport)
* [Ignition Rendering](https://ignitionrobotics.org/libs/rendering)
* [Ignition Msgs](https://ignitionrobotics.org/libs/msgs)
* [Gazebo CMake](https://gazebosim.org/libs/cmake)
* [Gazebo Math](https://gazebosim.org/libs/math)
* [Gazebo Common](https://gazebosim.org/libs/common)
* [Gazebo Transport](https://gazebosim.org/libs/transport)
* [Gazebo Rendering](https://gazebosim.org/libs/rendering)
* [Gazebo Msgs](https://gazebosim.org/libs/msgs)
* [SDFormat](https://github.com/osrf/sdformat)
* [Protobuf3](https://developers.google.com/protocol-buffers/)

Expand All @@ -132,24 +131,24 @@ Ignition Sensors requires:
4. Clone the repository

```
git clone https://github.com/ignitionrobotics/ign-sensors
git clone https://github.com/gazebosim/gz-sensors
```

5. Configure and build

```
cd ign-sensors; mkdir build;cd build; cmake ..; make
cd gz-sensors; mkdir build;cd build; cmake ..; make
```

6. Optionally, install Ignition Common
6. Optionally, install Gazebo Common

```
sudo make install
```

# Usage

Please refer to the [examples directory](https://github.com/ignitionrobotics/ign-sensors/raw/ign-sensors3/examples/).
Please refer to the [examples directory](https://github.com/gazebosim/gz-sensors/raw/ign-sensors3/examples/).

# Folder Structure

Expand All @@ -171,17 +170,17 @@ Refer to the following table for information about important directories and fil

# Contributing

Please see the [contribution guide](https://ignitionrobotics.org/docs/all/contributing).
Please see the [contribution guide](https://gazebosim.org/docs/all/contributing).

# Code of Conduct

Please see
[CODE_OF_CONDUCT.md](https://github.com/ignitionrobotics/ign-gazebo/blob/main/CODE_OF_CONDUCT.md).
[CODE_OF_CONDUCT.md](https://github.com/gazebosim/gz-sim/blob/main/CODE_OF_CONDUCT.md).

# Versioning

This library uses [Semantic Versioning](https://semver.org/). Additionally, this library is part of the [Ignition Robotics project](https://ignitionrobotics.org) which periodically releases a versioned set of compatible and complimentary libraries. See the [Ignition Robotics website](https://ignitionrobotics.org) for version and release information.
This library uses [Semantic Versioning](https://semver.org/). Additionally, this library is part of the [Gazebo project](https://gazebosim.org) which periodically releases a versioned set of compatible and complimentary libraries. See the [Gazebo website](https://gazebosim.org) for version and release information.

# License

This library is licensed under [Apache 2.0](https://www.apache.org/licenses/LICENSE-2.0). See also the [LICENSE](https://github.com/ignitionrobotics/ign-sensors/blob/main/LICENSE) file.
This library is licensed under [Apache 2.0](https://www.apache.org/licenses/LICENSE-2.0). See also the [LICENSE](https://github.com/gazebosim/gz-sensors/blob/main/LICENSE) file.

0 comments on commit a82550d

Please sign in to comment.