Skip to content

Commit

Permalink
Apply suggestions from code review
Browse files Browse the repository at this point in the history
Co-authored-by: Steve Macenski <stevenmacenski@gmail.com>
Signed-off-by: Aarav Gupta <amronos275@gmail.com>
  • Loading branch information
Amronos and SteveMacenski authored Jan 28, 2025
1 parent ac0fe27 commit 4c2b0d3
Show file tree
Hide file tree
Showing 2 changed files with 2 additions and 2 deletions.
2 changes: 1 addition & 1 deletion setup_guides/sdf/setup_sdf.rst
Original file line number Diff line number Diff line change
Expand Up @@ -13,7 +13,7 @@ For this guide, we will be creating the SDF (Simulation Description Format) file
About SDF
=========

SDF is a specific file for simulators, like Gazebo, that describes the simulator environment, model (including its frames and Gazebo-specific information), and appropriate plugins. The SDF that we will make is for Gazebo, but could be replaced with an appropriate SDF or other format file for Open3D Engine or Isaac Sim.
SDF is a file format for simulators, like Gazebo, that describes the simulator environment, models (including its links, connections, and physics simulator metadata), and appropriate plugins. The SDF that we will make is for modern Gazebo, but there are other simulator options such as Open3D Engine or Isaac Sim.

We can also use our SDF with the robot_state_publisher but the following package would be required to do that:

Expand Down
2 changes: 1 addition & 1 deletion setup_guides/sensors/setup_sensors_gz.rst
Original file line number Diff line number Diff line change
Expand Up @@ -255,7 +255,7 @@ In your SDF, paste the following lines after the ``</link>`` tag of the lidar se
</sensor>
</link>
In the code snippet above we set the sensor values of camera_link to the simulated depth camera's properties and configure the sensor such that it will publish sensor_msgs/Image and sensor_msgs/PointCloud2 messages to /depth_camera/image_raw and /depth_camera/points topics respectively.
In the code snippet above we set the sensor values of camera_link to the simulated depth camera's properties and configure the sensor such that it will publish sensor_msgs/Image and ``sensor_msgs/PointCloud2`` messages to `/depth_camera/image_raw`` and ``/depth_camera/points`` topics respectively.

Updating Bridge Config
======================
Expand Down

0 comments on commit 4c2b0d3

Please sign in to comment.