Skip to content

Commit

Permalink
Update README.md
Browse files Browse the repository at this point in the history
  • Loading branch information
kuriatsu authored Jan 7, 2023
1 parent 02c06d2 commit 2a89c04
Showing 1 changed file with 8 additions and 4 deletions.
12 changes: 8 additions & 4 deletions README.md
Original file line number Diff line number Diff line change
Expand Up @@ -5,7 +5,8 @@
[![GitHub](https://img.shields.io/github/license/carla-simulator/ros-bridge)](https://github.com/carla-simulator/ros-bridge/blob/master/LICENSE)
[![GitHub release (latest by date)](https://img.shields.io/github/v/release/carla-simulator/ros-bridge)](https://github.com/carla-simulator/ros-bridge/releases/latest)

This ROS package is a bridge that enables two-way communication between ROS and CARLA. The information from the CARLA server is translated to ROS topics. In the same way, the messages sent between nodes in ROS get translated to commands to be applied in CARLA.
The official [ros-bridge](https://github.com/carla-simulator/ros-bridge) is modified.
This ros package enables autonomous driving using Autoware in addition to the basic function of the official [ros-bridge](https://github.com/carla-simulator/ros-bridge) package (communication between ros and carla)

![control_carla_universe](https://user-images.githubusercontent.com/38074802/187683146-2b8d492b-6997-4460-af1a-66ea364c90ed.gif)

Expand All @@ -25,24 +26,26 @@
* [CARLA Installation](https://carla.readthedocs.io/en/latest/start_quickstart/) (Debian installation)
* carla-ros-bridge (this repo)
```bash
mkdir -p ros2_ws/src
cd ros2_ws/src
git clone [email protected]:kuriatsu/ros-bridge.git --recursive
```
* [derived_object_msgs](https://github.com/astuff/astuff_sensor_msgs) (branch 3.3.0)
```bash
cd ros-bridge/src
cd ros2_ws/src
git clone [email protected]:astuff/astuff_sensor_msgs.git
cd astuff_sensor_msgs
git checkout -b 3.3.0 refs/tags/3.3.0
```
* [autoware containts](https://bitbucket.org/carla-simulator/autoware-contents/src/master/maps/)
1. Download maps (y-axis inverted version)
1. Download maps (y-axis inverted version) to arbitaly location
2. Change names. (point_cloud/Town01.pcd -> Town01/pointcloud_map.pcd, vector_maps/lanelet2/Town01.osm -> Town01/lanelet2_map.osm)

* Change file path at `carla_spawn_objects/carla_spawn_objects.py L49` as shown in first paragraph of Fix Log.

## build
```bash
cd ros-bridge
cd ros2_ws
colcon build --symlink-install
```
# Getting start
Expand All @@ -51,6 +54,7 @@ colcon build --symlink-install
```bash
/opt/carla/CarlaUE4.sh
python3 /opt/carla/PythonAPI/util/config.py -m Town10
# optional
python3 /opt/carla/PythonAPI/examples/generate_traffic.py -n 10 -w 20
```

Expand Down

0 comments on commit 2a89c04

Please sign in to comment.