-
Notifications
You must be signed in to change notification settings - Fork 21
/
px4_ros2_gazebo.yml
30 lines (29 loc) · 943 Bytes
/
px4_ros2_gazebo.yml
1
2
3
4
5
6
7
8
9
10
11
12
13
14
15
16
17
18
19
20
21
22
23
24
25
26
27
28
29
30
# ~/.config/tmuxinator/px4_ros2_gazebo.yml
name: px4_ros2_gazebo
root: /root
windows:
- Micro_XRCE_Agent:
root: /root/Micro-XRCE-DDS-Agent
layout: even-vertical
panes:
- MicroXRCEAgent udp4 -p 8888
- PX4_Autopilot:
root: /root/PX4-Autopilot
layout: even-vertical
panes:
- sleep 3 && PX4_SYS_AUTOSTART=4002 PX4_GZ_MODEL_POSE="268.08,-128.22,3.86,0.00,0,-0.7" PX4_GZ_MODEL=x500_depth ./build/px4_sitl_default/bin/px4
- ROS_GZ_Image_Bridge:
root: /root/ws_sensor_combined
layout: even-vertical
panes:
- sleep 6 && ros2 run ros_gz_image image_bridge /camera
- YOLO_Detection:
root: /root/PX4-ROS2-Gazebo-YOLOv8
layout: even-vertical
panes:
- sleep 6 && python3 uav_camera_det.py
- MAVSDK_Control:
root: /root/PX4-ROS2-Gazebo-YOLOv8
layout: even-vertical
panes:
- sleep 6 && python3 keyboard-mavsdk-test.py