Skip to content

Commit

Permalink
[ign-gazebo3] Update BitBucket links (#64)
Browse files Browse the repository at this point in the history
* [ign-gazebo3] Update BitBucket links

Signed-off-by: Louise Poubel <[email protected]>

* [ign-gazebo3] Update BitBucket links

Signed-off-by: Louise Poubel <[email protected]>

* Apply suggestions from code review

Co-authored-by: Marya Belanger <[email protected]>
  • Loading branch information
chapulina and maryaB-osr authored Apr 22, 2020
1 parent d93228e commit 2f01765
Show file tree
Hide file tree
Showing 20 changed files with 273 additions and 657 deletions.
384 changes: 1 addition & 383 deletions CONTRIBUTING.md

Large diffs are not rendered by default.

424 changes: 212 additions & 212 deletions Changelog.md

Large diffs are not rendered by default.

4 changes: 2 additions & 2 deletions Migration.md
Original file line number Diff line number Diff line change
Expand Up @@ -32,8 +32,8 @@ release will remove the deprecated code.
updated to report its scoped name.

* Log files generated from Ignition Gazebo 1.X are no longer compatible with
Gazebo 2+ for playback. [Pull request
#257](https://bitbucket.org/ignitionrobotics/ign-gazebo/pull-requests/257)
Gazebo 2+ for playback. [BitBucket pull request
#257](https://osrf-migration.github.io/ignition-gh-pages/#!/ignitionrobotics/ign-gazebo/pull-requests/257)
added an SDF message to the start of log files.

## Ignition Gazebo 1.0.2 to 1.1.0
Expand Down
68 changes: 34 additions & 34 deletions README.md
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@

**Maintainer:** louise AT openrobotics DOT org

[![Bitbucket open issues](https://img.shields.io/bitbucket/issues-raw/ignitionrobotics/ign-gazebo.svg)](https://bitbucket.org/ignitionrobotics/ign-gazebo/issues)
[![Bitbucket open pull requests](https://img.shields.io/bitbucket/pr-raw/ignitionrobotics/ign-gazebo.svg)](https://bitbucket.org/ignitionrobotics/ign-gazebo/pull-requests)
[![GitHub open issues](https://img.shields.io/github/issues-raw/ignitionrobotics/ign-gazebo.svg)](https://github.com/ignitionrobotics/ign-gazebo/issues)
[![GitHub open pull requests](https://img.shields.io/github/issues-pr-raw/ignitionrobotics/ign-gazebo.svg)](https://github.com/ignitionrobotics/ign-gazebo/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)

Expand All @@ -20,56 +20,56 @@ Ignition Gazebo is derived from [Gazebo](http://gazebosim.org) and represents ov

# Table of Contents

[Features](#markdown-header-features)
[Features](#features)

[Install](#markdown-header-install)
[Install](#install)

* [Binary Install](#markdown-header-binary-install)
* [Binary Install](#binary-install)

* [Source Install](#markdown-header-source-install)
* [Source Install](#source-install)

* [Prerequisites](#markdown-header-prerequisites)
* [Prerequisites](#prerequisites)

* [Building from Source](#markdown-header-building-from-source)
* [Building from Source](#building-from-source)

[Usage](#markdown-header-usage)
[Usage](#usage)

[Documentation](#markdown-header-documentation)
[Documentation](#documentation)

[Testing](#markdown-header-testing)
[Testing](#testing)

[Folder Structure](#markdown-header-folder-structure)
[Folder Structure](#folder-structure)

[Code of Conduct](#markdown-header-code-of-conduct)
[Code of Conduct](#code-of-conduct)

[Contributing](#markdown-header-code-of-contributing)
[Contributing](#code-of-contributing)

[Versioning](#markdown-header-versioning)
[Versioning](#versioning)

[License](#markdown-header-license)
[License](#license)

# Features

* **Dynamics simulation**: Access multiple high-performance physics engines
through
[Ignition Physics](https://bitbucket.org/ignitionrobotics/ign-physics).
[Ignition Physics](https://github.com/ignitionrobotics/ign-physics).

* **Advanced 3D graphics**: Through
[Ignition Rendering](https://bitbucket.org/ignitionrobotics/ign-rendering),
[Ignition Rendering](https://github.com/ignitionrobotics/ign-rendering),
it's possible to use rendering engines such as OGRE v2 for realistic rendering
of environments with high-quality lighting, shadows, and textures.

* **Sensors and noise models**: Generate sensor data, optionally with noise,
from laser range finders, 2D/3D cameras, Kinect style sensors, contact sensors,
force-torque, IMU, GPS, and more, powered by
[Ignition Sensors](https://bitbucket.org/ignitionrobotics/ign-sensors)
[Ignition Sensors](https://github.com/ignitionrobotics/ign-sensors)

* **Plugins**: Develop custom plugins for robot, sensor, and
environment control.

* **Graphical interface**: Create, instrospect and interact with your simulations
through plugin-based graphical interfaces powered by
[Ignition GUI](https://bitbucket.org/ignitionrobotics/ign-gui).
[Ignition GUI](https://github.com/ignitionrobotics/ign-gui).

* **Simulation models**: Access numerous robots including PR2, Pioneer2 DX,
iRobot Create, and TurtleBot, and construct environments using other physically
Expand All @@ -79,24 +79,24 @@ new model using [SDF](http://sdformat.org).

* **TCP/IP Transport**: Run simulation on remote servers and interface to Ignition
Gazebo through socket-based message passing using
[Ignition Transport](https://bitbucket.org/ignitionrobotics/ign-transport).
[Ignition Transport](https://github.com/ignitionrobotics/ign-transport).

* **Command line tools**: Extensive command line tools for increased simulation
introspection and control.

# Install

We recommend following the [Binary Install](#markdown-header-binary-install) instructions to get up and running as quickly and painlessly as possible.
We recommend following the [Binary Install](#binary-install) instructions to get up and running as quickly and painlessly as possible.

The [Source Install](#markdown-header-source-install) instructions should be used if you need the very latest software improvements, you need to modify the code, or you plan to make a contribution.
The [Source Install](#source-install) instructions should be used if you need the very latest software improvements, you need to modify the code, or you plan to make a contribution.

## Binary Install

The binary install method will use pre-built packages which are typically
available through a package management utility such as [Apt](https://wiki.debian.org/Apt).
This approach eliminates the need to download and compile source code, and dependencies
are handled for you. The downside of a binary install is that you won't be able to modify
the code. See [Source Install](#markdown-header-source-install) for information on
the code. See [Source Install](#source-install) for information on
installing Ignition Gazebo from source.

**Ubuntu Bionic (version 2)**
Expand Down Expand Up @@ -167,7 +167,7 @@ for dependency installation instructions for each supported operating system.
### Building from source
1. Install [prerequisites](#markdown-header-prerequisites)
1. Install [prerequisites](#prerequisites)
2. Configure gcc8
Expand All @@ -180,7 +180,7 @@ for dependency installation instructions for each supported operating system.
1. Clone the repository.
```
hg clone https://bitbucket.org/ignitionrobotics/ign-gazebo -b default
git clone https://github.com/ignitionrobotics/ign-gazebo -b master
```
2. Configure and build.
Expand All @@ -195,7 +195,7 @@ for dependency installation instructions for each supported operating system.
# Usage
Gazebo can be run from the command line, once [installed](#markdown-header-install), using:
Gazebo can be run from the command line, once [installed](#install), using:
```
ign gazebo
Expand Down Expand Up @@ -234,7 +234,7 @@ ln -s /usr/local/share/ignition/transportlog7.yaml .
export IGN_CONFIG_PATH=$HOME/.ignition/tools/configs
```
This issue is tracked [here](https://bitbucket.org/ignitionrobotics/ign-tools/issues/8/too-strict-looking-for-config-paths).
This issue is tracked [here](https://github.com/ignitionrobotics/ign-tools/issues/8).
# Documentation
Expand All @@ -251,7 +251,7 @@ You can also generate the documentation from a clone of this repository by follo
2. Clone the repository
```
hg clone https://bitbucket.org/ignitionrobotics/ign-gazebo
git clone https://github.com/ignitionrobotics/ign-gazebo
```
3. Configure and build the documentation.
Expand All @@ -274,7 +274,7 @@ You can also generate the documentation from a clone of this repository by follo
Follow these steps to run tests and static code analysis in your clone of this repository.
1. Follow the [source install instruction](#markdown-header-source-install).
1. Follow the [source install instruction](#source-install).
2. Run tests.
Expand All @@ -288,7 +288,7 @@ Follow these steps to run tests and static code analysis in your clone of this r
make codecheck
```
See the [Writing Tests section of the contributor guide](https://bitbucket.org/ignitionrobotics/ign-gazebo/src/406665896aa40bb42f14cf61d48b3d94f2fc5dd8/CONTRIBUTING.md#markdown-header-writing-tests) for help creating or modifying tests.
See the [Writing Tests section of the contributor guide](https://github.com/ignitionrobotics/ign-gazebo/blob/master/CONTRIBUTING.md#writing-tests) for help creating or modifying tests.
# Folder Structure
Expand Down Expand Up @@ -320,17 +320,17 @@ ign-gazebo
# Contributing
Please see
[CONTRIBUTING.md](https://bitbucket.org/ignitionrobotics/ign-gazebo/src/406665896aa40bb42f14cf61d48b3d94f2fc5dd8/CONTRIBUTING.md?at=default&fileviewer=file-view-default).
[CONTRIBUTING.md](https://github.com/ignitionrobotics/ign-gazebo/blob/master/CONTRIBUTING.md).
# Code of Conduct
Please see
[CODE_OF_CONDUCT.md](https://bitbucket.org/ignitionrobotics/ign-gazebo/src/406665896aa40bb42f14cf61d48b3d94f2fc5dd8/CODE_OF_CONDUCT.md?at=default&fileviewer=file-view-default).
[CODE_OF_CONDUCT.md](https://github.com/ignitionrobotics/ign-gazebo/blob/master/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.
# License
This library is licensed under [Apache 2.0](https://www.apache.org/licenses/LICENSE-2.0). See also the [LICENSE](https://bitbucket.org/ignitionrobotics/ign-gazebo/src/406665896aa40bb42f14cf61d48b3d94f2fc5dd8/LICENSE?at=default&fileviewer=file-view-default) file.
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-gazebo/blob/master/LICENSE) file.
2 changes: 1 addition & 1 deletion doc/architecture_design.md
Original file line number Diff line number Diff line change
Expand Up @@ -118,7 +118,7 @@ level and performer is only simulated at one runner at a time.
It would be convenient to be able to specify standalone programs in the SDF
file so they're loaded at the same time as the simulation. For example,
Gazebo's
[JoyPlugin](https://bitbucket.org/osrf/gazebo/src/default/plugins/JoyPlugin.hh?fileviewer=file-view-default)
[JoyPlugin](https://github.com/osrf/gazebo/blob/master/plugins/JoyPlugin.hh)
is a `WorldPlugin`, but it doesn't need to access any world API, or to run
in the physics thread, or even to run in the gzserver process. However,
it was implemented as a plugin because that makes it easier to specify in
Expand Down
4 changes: 2 additions & 2 deletions docker/scripts/build_ign.sh
Original file line number Diff line number Diff line change
@@ -1,13 +1,13 @@
#!/bin/bash
# Command line parameters:
# 1 - bitbucket organization name. For example ignitionrobotics or osrf.
# 1 - github organization name. For example ignitionrobotics or osrf.
# 2 - the name of the ignition repository. For example ign-math.
# 3 - the name of the branch. For example ign-math6

set -o errexit
set -o verbose

hg clone https://bitbucket.org/$1/$2 -b $3
git clone https://github.com/$1/$2 -b $3
cd $2
mkdir build
cd build
Expand Down
1 change: 0 additions & 1 deletion docker/scripts/install_common_deps.sh
Original file line number Diff line number Diff line change
Expand Up @@ -18,7 +18,6 @@ sudo apt-get install -y \
curl \
git \
g++-8 \
mercurial \
pkg-config \

sudo apt-get install -y \
Expand Down
2 changes: 1 addition & 1 deletion docker/scripts/upload_json_benchmark.sh
Original file line number Diff line number Diff line change
@@ -1,6 +1,6 @@
#!/bin/bash
# Command line parameters:
# 1 - bitbucket organization name. For example ignitionrobotics or osrf.
# 1 - github organization name. For example ignitionrobotics or osrf.
# 2 - the name of the ignition repository. For example ign-math.
# 3 - the name of the branch. For example ign-math6

Expand Down
4 changes: 2 additions & 2 deletions examples/standalone/joy_to_twist/README.md
Original file line number Diff line number Diff line change
@@ -1,9 +1,9 @@
# Joy to Twist

Standalone program that subscribes to
[ignition::msgs::Joy](https://bitbucket.org/ignitionrobotics/ign-msgs/src/default/proto/ignition/msgs/joy.proto)
[ignition::msgs::Joy](https://github.com/ignitionrobotics/ign-msgs/blob/master/proto/ignition/msgs/joy.proto)
messages and converts publishes
[ignition::msgs::Twist](https://bitbucket.org/ignitionrobotics/ign-msgs/src/default/proto/ignition/msgs/twist.proto)
[ignition::msgs::Twist](https://github.com/ignitionrobotics/ign-msgs/blob/master/proto/ignition/msgs/twist.proto)
messages according to user-defined configuration.

## Build
Expand Down
2 changes: 1 addition & 1 deletion examples/standalone/joystick/README.md
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
# Joystick

Standalone program that publishes
[ignition::msgs::Joy](https://bitbucket.org/ignitionrobotics/ign-msgs/src/default/proto/ignition/msgs/joy.proto)
[ignition::msgs::Joy](https://github.com/ignitionrobotics/ign-msgs/blob/master/proto/ignition/msgs/joy.proto)
messages from a joystick device using Ignition Transport.

The mapping of joystick buttons to fields in the message is the same as [this](http://wiki.ros.org/joy).
Expand Down
2 changes: 1 addition & 1 deletion src/ign_TEST.cc
Original file line number Diff line number Diff line change
Expand Up @@ -26,7 +26,7 @@
static const std::string kBinPath(PROJECT_BINARY_PATH);

// Command line not working on OSX, see
// https://bitbucket.org/ignitionrobotics/ign-gazebo/issues/25/
// https://github.com/ignitionrobotics/ign-gazebo/issues/25/
#ifndef __APPLE__
static const std::string kIgnCommand(
"IGN_GAZEBO_SYSTEM_PLUGIN_PATH=" + kBinPath + "/lib LD_LIBRARY_PATH=" +
Expand Down
2 changes: 1 addition & 1 deletion src/network/NetworkManagerPrimary.cc
Original file line number Diff line number Diff line change
Expand Up @@ -207,7 +207,7 @@ bool NetworkManagerPrimary::SecondariesCanStep() const
// TODO(anyone) Ideally we'd check the number of connections against the
// number of expected secondaries, but there's no interface for that
// on ign-transport yet:
// https://bitbucket.org/ignitionrobotics/ign-transport/issues/39
// https://github.com/ignitionrobotics/ign-transport/issues/39
return this->simStepPub.HasConnections();
}

Expand Down
2 changes: 1 addition & 1 deletion src/systems/physics/Physics.cc
Original file line number Diff line number Diff line change
Expand Up @@ -362,7 +362,7 @@ void PhysicsPrivate::CreatePhysicsEntities(const EntityComponentManager &_ecm)

// Check if parent world exists
// TODO(louise): Support nested models, see
// https://bitbucket.org/ignitionrobotics/ign-physics/issues/10
// https://github.com/ignitionrobotics/ign-physics/issues/10
if (this->entityWorldMap.find(_parent->Data())
== this->entityWorldMap.end())
{
Expand Down
2 changes: 1 addition & 1 deletion test/integration/examples_build.cc
Original file line number Diff line number Diff line change
Expand Up @@ -24,7 +24,7 @@
#include "ignition/gazebo/test_config.hh"

// File copied from
// https://bitbucket.org/ignitionrobotics/ign-gui/raw/default/test/integration/ExamplesBuild_TEST.cc
// https://github.com/ignitionrobotics/ign-gui/raw/master/test/integration/ExamplesBuild_TEST.cc

using namespace ignition;

Expand Down
2 changes: 1 addition & 1 deletion test/integration/log_system.cc
Original file line number Diff line number Diff line change
Expand Up @@ -1278,7 +1278,7 @@ TEST_F(LogSystemTest, LogOverwrite)
// ign gazebo. server_main.cc is deprecated and does not have overwrite
// renaming implemented. So will always overwrite. Will not test (#) type of
// renaming on OS X until ign gazebo is fixed:
// https://bitbucket.org/ignitionrobotics/ign-gazebo/issues/25/apple-support-for-ign-command-line-tool
// https://github.com/ignitionrobotics/ign-gazebo/issues/25

// New log files were created
EXPECT_TRUE(common::exists(this->logDir + "(1)"));
Expand Down
2 changes: 1 addition & 1 deletion test/integration/network_handshake.cc
Original file line number Diff line number Diff line change
Expand Up @@ -146,7 +146,7 @@ TEST_F(NetworkHandshake, Updates)
configPrimary.SetUseLevels(true);
// Can only test one secondary running physics, because running 2 physics in
// the same process causes a segfault, see
// https://bitbucket.org/ignitionrobotics/ign-gazebo/issues/18
// https://github.com/ignitionrobotics/ign-gazebo/issues/18
configPrimary.SetNetworkSecondaries(1);
configPrimary.SetSdfFile(std::string(PROJECT_SOURCE_PATH) +
"/test/worlds/performers.sdf");
Expand Down
4 changes: 2 additions & 2 deletions test/integration/touch_plugin.cc
Original file line number Diff line number Diff line change
Expand Up @@ -103,7 +103,7 @@ TEST_F(TouchPluginTest, OneLink)
std::this_thread::sleep_for(std::chrono::milliseconds(30));
}
// Known to fail on OSX, see
// https://bitbucket.org/ignitionrobotics/ign-gazebo/issues/22
// https://github.com/ignitionrobotics/ign-gazebo/issues/22
#if !defined (__APPLE__)
EXPECT_TRUE(whiteTouched);
#endif
Expand Down Expand Up @@ -183,7 +183,7 @@ TEST_F(TouchPluginTest, StartDisabled)
std::this_thread::sleep_for(std::chrono::milliseconds(30));
}
// Known to fail on OSX, see
// https://bitbucket.org/ignitionrobotics/ign-gazebo/issues/22
// https://github.com/ignitionrobotics/ign-gazebo/issues/22
#if !defined (__APPLE__)
EXPECT_TRUE(blueTouched);
#endif
Expand Down
2 changes: 1 addition & 1 deletion tutorials/distributed_simulation.md
Original file line number Diff line number Diff line change
Expand Up @@ -125,7 +125,7 @@ keeps all performers loaded, but performs no physics simulation.
Stepping happens in 2 stages: the primary update and the secondaries update,
according to the diagram below:

<img src="https://bytebucket.org/ignitionrobotics/ign-gazebo/raw/default/tutorials/files/distributed_step.png"/>
<img src="https://raw.githubusercontent.com/ignitionrobotics/ign-gazebo/master/tutorials/files/distributed_step.png"/>

1. The primary publishes a `SimulationStep` message on the `/step` topic,
containing:
Expand Down
Loading

0 comments on commit 2f01765

Please sign in to comment.