Skip to content

Commit f5fe90c

Browse files
committed
Update docs
1 parent e4ac408 commit f5fe90c

File tree

2 files changed

+29
-26
lines changed

2 files changed

+29
-26
lines changed

README.md

Lines changed: 8 additions & 26 deletions
Original file line numberDiff line numberDiff line change
@@ -1,5 +1,5 @@
11
# Simulation Stack
2-
This package allows you to simulate Marvin (ARV's 2022-2024 robot) using RViz and Gazebo
2+
This package allows you to simulate ARV robots using RViz and Gazebo
33

44

55
## Package Dependencies
@@ -35,36 +35,17 @@ The simulation is fairly computation intensive so a GPU is recommended. Note tha
3535
4. ```source install/setup.bash```
3636

3737
### Launching
38-
Running ```ros2 launch simulation_marvin display.launch.py``` will open RViz and display the robot model. This launch file is made to quickly check if the robot model is correctly formatted and used internally when developing the stack.
38+
Running ```ros2 launch simulation_common display.launch.py``` will open RViz and display the robot model. This launch file is made to quickly check if the robot model is correctly formatted and used internally when developing the stack.
3939

40-
Running ```ros2 launch simulation_marvin simulation.launch.py``` will spawn the robot in Gazebo and visualize sensor outputs in RViz. Any project interfacing with the simulation should use this launch file.
41-
42-
43-
## Interfacing with the Stack
44-
### Topics
45-
#### Robot
46-
```/cmd_vel``` (```geometry_msgs/msg/Twist```) - target velocity for the robot to move in
47-
```/odom``` (```nav_msgs/msg/Odometry```) - an estimation of the robot's position and velocity
48-
49-
#### LiDAR
50-
```/velodyne_points``` (```sensor_msgs/msg/PointCloud2```) - pointcloud output of the LiDAR
51-
```/scan``` (```sensor_msgs/msg/LaserScan```) - converted laser scan of the LiDAR pointcloud on the x-y plane
52-
53-
#### Camera
54-
```/zed/camera_info``` (```sensor_msgs/msg/CameraInfo```) - Information about the camera
55-
```/zed/depth/camera_info``` (```sensor_msgs/msg/CameraInfo```) - Information about the depth camera
56-
```/zed/depth/image_raw``` (```sensor_msgs/msg/Image```) - Raw depth image
57-
```/zed/image_raw``` (```sensor_msgs/msg/Image```) - Raw image
58-
```/zed/points``` (```sensor_msgs/msg/PointCloud2```) - Point cloud of the camera's depth data (warning: visualizing this in RViz is VERY computationally intensive)
59-
60-
#### IMU
61-
```/imu_controller/out``` (```sensor_msgs/msg/Imu```) - IMU data
40+
Running ```ros2 launch simulation_common simulation.launch.py``` will spawn the robot in Gazebo and visualize sensor outputs in RViz. Any project interfacing with the simulation should use this launch file.
6241

6342
### Launch File Arguments
6443
#### display.launch.py
44+
```model``` (default: ```marvin```) - the model to display (remove simulation_ to get model name)
6545
```joint_gui``` (default: ```True```) - whether to enable joint_state_publisher_gui
6646

6747
#### simulation.launch.py
48+
```model``` (default: ```marvin```) - the model to simulate (remove simulation_ to get model name)
6849
```headless``` (default: ```False```) - whether to enable RViz. If you have other code that runs their own instance of RViz (ex. Nav2), you should set headless to True
6950
```world``` (default: ```empty```) - Name of the Gazebo world file in the world directory
7051

@@ -84,7 +65,8 @@ Since multiple subteams may use this stack as a dependency, **do not include thi
8465
![image](https://github.com/umigv/simulation_stack/assets/71594512/9130685b-c081-4591-942f-6b38e1be852f)
8566

8667
## Learning more
87-
Visit the [wiki](https://github.com/umigv/simulation_stack/wiki) to learn about how to set up robot models for simulation
68+
Visit the [wiki](https://github.com/umigv/simulation_stack/wiki) to learn about how to set up robot models for simulation
69+
Go into the folder of individual robots to see the topics that is outputted
8870

8971
## Possible Issues
9072
### symbol lookup error: ... undefined symbol: __libc_pthread_init, version GLIBC_PRIVATE
@@ -101,4 +83,4 @@ This error is caused by [snap variables leaking into terminal variables](https:/
10183
## Credits
10284
Jason Ning and Kari Naga on the sensors team, who created the original URDF files and the Gazebo World in the [marvin](https://github.com/umigv/marvin/tree/main/urdf) repository.
10385

104-
[UTRA ART](https://github.com/UTRA-ART) for their [full IGVC course world](https://github.com/UTRA-ART/Caffeine/tree/master/worlds/). Any file or folder containing IGVC is under the original [Apache 2.0 license](https://github.com/umigv/simulation_stack/blob/igvc_course/simulation_marvin/world/LICENSE)
86+
[UTRA ART](https://github.com/UTRA-ART) for their [full IGVC course world](https://github.com/UTRA-ART/Caffeine/tree/master/worlds/). Any file or folder containing IGVC is under the original [Apache 2.0 license](https://github.com/umigv/simulation_stack/blob/igvc_course/simulation_common/world/LICENSE)

simulation_marvin/readme.md

Lines changed: 21 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -0,0 +1,21 @@
1+
## Marvin
2+
ARV's robot used in IGVC 2024
3+
4+
## Topics
5+
### Robot
6+
```/cmd_vel``` (```geometry_msgs/msg/Twist```) - target velocity for the robot to move in
7+
```/odom``` (```nav_msgs/msg/Odometry```) - an estimation of the robot's position and velocity
8+
9+
### LiDAR
10+
```/velodyne_points``` (```sensor_msgs/msg/PointCloud2```) - pointcloud output of the LiDAR
11+
```/scan``` (```sensor_msgs/msg/LaserScan```) - converted laser scan of the LiDAR pointcloud on the x-y plane
12+
13+
### Camera
14+
```/zed/camera_info``` (```sensor_msgs/msg/CameraInfo```) - Information about the camera
15+
```/zed/depth/camera_info``` (```sensor_msgs/msg/CameraInfo```) - Information about the depth camera
16+
```/zed/depth/image_raw``` (```sensor_msgs/msg/Image```) - Raw depth image
17+
```/zed/image_raw``` (```sensor_msgs/msg/Image```) - Raw image
18+
```/zed/points``` (```sensor_msgs/msg/PointCloud2```) - Point cloud of the camera's depth data (warning: visualizing this in RViz is VERY computationally intensive)
19+
20+
### IMU
21+
```/imu_controller/out``` (```sensor_msgs/msg/Imu```) - IMU data

0 commit comments

Comments
 (0)