From fb6fdeda13860181e306f6e4ea12384cb474d32c Mon Sep 17 00:00:00 2001 From: Jonas Vautherin Date: Wed, 27 Sep 2023 18:27:29 +0200 Subject: [PATCH] Bump PX4 to v1.13.3 --- Dockerfile | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/Dockerfile b/Dockerfile index f98d92f..b65bf3a 100644 --- a/Dockerfile +++ b/Dockerfile @@ -46,7 +46,7 @@ RUN pip3 install --upgrade pip && \ pyyaml RUN git clone https://github.com/PX4/PX4-Autopilot.git ${FIRMWARE_DIR} -RUN git -C ${FIRMWARE_DIR} checkout main +RUN git -C ${FIRMWARE_DIR} checkout v1.13.3 RUN git -C ${FIRMWARE_DIR} submodule update --init --recursive COPY edit_rcS.bash ${WORKSPACE_DIR}