Skip to content

Commit

Permalink
Bumps in garden: depend on ign-math7, ign-common5 and sdformat13
Browse files Browse the repository at this point in the history
Signed-off-by: Louise Poubel <louise@openrobotics.org>
  • Loading branch information
chapulina authored Dec 29, 2021
1 parent 73542fa commit f198a7b
Show file tree
Hide file tree
Showing 5 changed files with 18 additions and 18 deletions.
8 changes: 4 additions & 4 deletions .github/ci/packages.apt
Original file line number Diff line number Diff line change
@@ -1,10 +1,10 @@
libbenchmark-dev
libeigen3-dev
libignition-cmake2-dev
libignition-common4-dev
libignition-math6-dev
libignition-math6-eigen3-dev
libignition-common5-dev
libignition-math7-dev
libignition-math7-eigen3-dev
libignition-plugin-dev
libignition-utils1-cli-dev
libignition-utils1-dev
libsdformat12-dev
libsdformat13-dev
10 changes: 5 additions & 5 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -34,15 +34,15 @@ message(STATUS "\n\n-- ====== Finding Dependencies ======")

#--------------------------------------
# Find ignition-common
ign_find_package(ignition-common4
ign_find_package(ignition-common5
COMPONENTS graphics profiler
REQUIRED_BY heightmap mesh dartsim tpe tpelib bullet)
set(IGN_COMMON_VER ${ignition-common4_VERSION_MAJOR})
set(IGN_COMMON_VER ${ignition-common5_VERSION_MAJOR})

#--------------------------------------
# Find ignition-math
ign_find_package(ignition-math6 REQUIRED COMPONENTS eigen3)
set(IGN_MATH_VER ${ignition-math6_VERSION_MAJOR})
ign_find_package(ignition-math7 REQUIRED COMPONENTS eigen3)
set(IGN_MATH_VER ${ignition-math7_VERSION_MAJOR})

#--------------------------------------
# Find ignition-plugin
Expand All @@ -60,7 +60,7 @@ ign_find_package(EIGEN3 REQUIRED)

#--------------------------------------
# Find SDFormat for the SDF features
ign_find_package(sdformat12
ign_find_package(sdformat13
REQUIRED_BY sdf dartsim tpe bullet)

#--------------------------------------
Expand Down
10 changes: 5 additions & 5 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-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)
Test coverage | [![codecov](https://codecov.io/gh/ignitionrobotics/ign-physics/branch/ign-physics6/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-physics6-bionic-amd64)](https://build.osrfoundation.org/job/ignition_physics-ci-ign-physics6-bionic-amd64)
Homebrew | [![Build Status](https://build.osrfoundation.org/buildStatus/icon?job=ignition_physics-ci-ign-physics6-homebrew-amd64)](https://build.osrfoundation.org/job/ignition_physics-ci-ign-physics6-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 @@ -74,7 +74,7 @@ See the [installation tutorial](https://ignitionrobotics.org/api/physics/5.0/ins

# Usage

Please refer to the [examples directory](https://github.com/ignitionrobotics/ign-physics/raw/ign-physics5/examples/).
Please refer to the [examples directory](https://github.com/ignitionrobotics/ign-physics/raw/ign-physics6/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-physics5
git clone https://github.com/ignitionrobotics/ign-physics -b ign-physics6
```
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-physics5) under `dartsim` directory.
The source code for Dartsim plugin can be found in [Ignition Physics repository](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics6) under `dartsim` directory.

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.
TPE ([Trivial Physics Engine](https://github.com/ignitionrobotics/ign-physics/tree/ign-physics6/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-physics5) 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-physics6) 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-physics5/examples/hello_world_loader/hello_world_loader.cc
wget https://raw.githubusercontent.com/ignitionrobotics/ign-physics/ign-physics6/examples/hello_world_loader/hello_world_loader.cc
```

### Examine the code
Expand Down

0 comments on commit f198a7b

Please sign in to comment.