Skip to content

Commit

Permalink
Added triggered camera example
Browse files Browse the repository at this point in the history
Signed-off-by: William Lew <WilliamMilesLew@gmail.com>
  • Loading branch information
WilliamLewww committed Mar 10, 2022
1 parent 91b0438 commit 2c3dd85
Showing 1 changed file with 8 additions and 0 deletions.
8 changes: 8 additions & 0 deletions ros_ign_gazebo_demos/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -41,6 +41,14 @@ Using the image bridge (unidirectional, uses [image_transport](http://wiki.ros.o
Using the regular bridge:

ros2 launch ros_ign_gazebo_demos camera.launch.py

To use a camera that only publishes information when triggered:

ros2 launch ros_ign_gazebo_demos triggered_camera.launch.py

Trigger the camera:

ros2 topic pub /camera/trigger std_msgs/msg/Bool "{data: true}" --once

![](images/camera_demo.png)

Expand Down

0 comments on commit 2c3dd85

Please sign in to comment.