Skip to content

Commit

Permalink
🎈 5.0.0 (#294)
Browse files Browse the repository at this point in the history
Signed-off-by: Louise Poubel <[email protected]>
  • Loading branch information
azeey committed Oct 1, 2021
1 parent 42d2320 commit ba3eb2c
Show file tree
Hide file tree
Showing 7 changed files with 19 additions and 13 deletions.
2 changes: 1 addition & 1 deletion CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -13,7 +13,7 @@ find_package(ignition-cmake2 2.8.0 REQUIRED)
#============================================================================
# Configure the project
#============================================================================
ign_configure_project(VERSION_SUFFIX pre1)
ign_configure_project(VERSION_SUFFIX)

#============================================================================
# Set project-specific options
Expand Down
2 changes: 1 addition & 1 deletion Changelog.md
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@

### Ignition Physics 5.x.x (20XX-XX-XX)

### Ignition Physics 5.0.0 (20XX-XX-XX)
### Ignition Physics 5.0.0 (2021-09-30)

1. Add GetJointTransmittedWrench feature
* [Pull request #283](https://github.com/ignitionrobotics/ign-physics/pull/283)
Expand Down
6 changes: 6 additions & 0 deletions Migration.md
Original file line number Diff line number Diff line change
Expand Up @@ -5,6 +5,12 @@ Deprecated code produces compile-time warnings. These warning serve as
notification to users that their code should be upgraded. The next major
release will remove the deprecated code.

## Ignition Physics 4.X to 5.X

### Modifications

1. Depends on sdformat12.

## Ignition Physics 4.1 to 4.2

### Additions
Expand Down
12 changes: 6 additions & 6 deletions README.md
Original file line number Diff line number Diff line change
Expand Up @@ -9,9 +9,9 @@

Build | Status
-- | --
Test coverage | [![codecov](https://codecov.io/gh/ignitionrobotics/ign-physics/branch/ign-physics4/graph/badge.svg)](https://codecov.io/gh/ignitionrobotics/ign-physics)
Ubuntu Bionic | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_physics-ci-ign-physics4-bionic-amd64)](https://build.osrfoundation.org/job/ignition_physics-ci-ign-physics4-bionic-amd64)
Homebrew | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_physics-ci-ign-physics4-homebrew-amd64)](https://build.osrfoundation.org/job/ignition_physics-ci-ign-physics4-homebrew-amd64)
Test coverage | [![codecov](https://codecov.io/gh/ignitionrobotics/ign-physics/branch/ign-physics5/graph/badge.svg)](https://codecov.io/gh/ignitionrobotics/ign-physics)
Ubuntu Bionic | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_physics-ci-ign-physics5-bionic-amd64)](https://build.osrfoundation.org/job/ignition_physics-ci-ign-physics5-bionic-amd64)
Homebrew | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_physics-ci-ign-physics5-homebrew-amd64)](https://build.osrfoundation.org/job/ignition_physics-ci-ign-physics5-homebrew-amd64)
Windows | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ign_physics-ci-win)](https://build.osrfoundation.org/job/ign_physics-ci-win)

Ignition Physics, a component of [Ignition
Expand Down Expand Up @@ -70,11 +70,11 @@ Ignition Physics provides the following functionality:

# Install

See the [installation tutorial](https://ignitionrobotics.org/api/physics/4.0/installation.html).
See the [installation tutorial](https://ignitionrobotics.org/api/physics/5.0/installation.html).

# Usage

Please refer to the [examples directory](https://github.com/ignitionrobotics/ign-physics/raw/ign-physics4/examples/).
Please refer to the [examples directory](https://github.com/ignitionrobotics/ign-physics/raw/ign-physics5/examples/).

# Documentation

Expand All @@ -91,7 +91,7 @@ You can also generate the documentation from a clone of this repository by follo
2. Clone the repository

```
git clone https://github.com/ignitionrobotics/ign-physics -b ign-physics4
git clone https://github.com/ignitionrobotics/ign-physics -b ign-physics5
```

3. Configure and build the documentation.
Expand Down
6 changes: 3 additions & 3 deletions tutorials/03_physics_plugins.md
Original file line number Diff line number Diff line change
Expand Up @@ -78,12 +78,12 @@ Users do not need to organize their own plugin implementations this way.

Dart ([Dynamic Animation and Robotics Toolkit](https://dartsim.github.io/)) is an open source library that provides data structures and algorithms for kinematic and dynamic applications in robotics and computer animation.
It is the default physics engine used in Ignition Simulation.
The source code for Dartsim plugin can be found in [Ignition Physics repository](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics4) under `dartsim` directory.
The source code for Dartsim plugin can be found in [Ignition Physics repository](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics5) under `dartsim` directory.

TPE ([Trivial Physics Engine](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics4/tpe)) is an open source library created by Open Robotics that enables fast, inexpensive kinematics simulation for entities at large scale.
TPE ([Trivial Physics Engine](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics5/tpe)) is an open source library created by Open Robotics that enables fast, inexpensive kinematics simulation for entities at large scale.
It supports higher-order fleet dynamics without real physics (eg. gravity, force, constraint etc.) and multi-machine synchronization.
Ignition support for TPE targets [Citadel](https://ignitionrobotics.org/docs/citadel) and onward releases.
The source code for TPE plugin can be found in [Ignition Physics repository](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics4) under the `tpe/plugin` directory.
The source code for TPE plugin can be found in [Ignition Physics repository](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics5) under the `tpe/plugin` directory.

The following is a list of features supported by each physics engine to help users select one that fits their needs.

Expand Down
2 changes: 1 addition & 1 deletion tutorials/05_plugin_loading.md
Original file line number Diff line number Diff line change
Expand Up @@ -30,7 +30,7 @@ cd hello_world_loader
Then download the example loader into your current directory by:

```bash
wget https://raw.githubusercontent.com/ignitionrobotics/ign-physics/ign-physics4/examples/hello_world_loader/hello_world_loader.cc
wget https://raw.githubusercontent.com/ignitionrobotics/ign-physics/ign-physics5/examples/hello_world_loader/hello_world_loader.cc
```

### Examine the code
Expand Down
2 changes: 1 addition & 1 deletion tutorials/08-implementing-a-custom-feature.md
Original file line number Diff line number Diff line change
Expand Up @@ -13,7 +13,7 @@ In the last \ref implementfeature "Implement physics feature" tutorial, we
know how to implement a dummy physics engine as a plugin and load it using
\ref ignition::physics "Ignition Physics API". In this tutorial, we will look
deeper into the structure of a physics engine plugin, for example, the available
[DART](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics4/dartsim)
[DART](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics5/dartsim)
physics engine in `ign-physics` repository and how to define a custom
\ref ignition::physics::Feature "Feature" for the plugin.

Expand Down

0 comments on commit ba3eb2c

Please sign in to comment.