File: 0004-Skip-test-that-writes-to-source-directory.patch

package info (click to toggle)
ros-image-common 1.12.1-1
  • links: PTS, VCS
  • area: main
  • in suites: forky, sid
  • size: 736 kB
  • sloc: cpp: 3,310; xml: 186; python: 38; makefile: 6
file content (20 lines) | stat: -rw-r--r-- 733 bytes parent folder | download
1
2
3
4
5
6
7
8
9
10
11
12
13
14
15
16
17
18
19
20
From: =?utf-8?q?Timo_R=C3=B6hling?= <roehling@debian.org>
Date: Mon, 22 Sep 2025 11:44:23 +0200
Subject: Skip test that writes to source directory

---
 camera_info_manager/tests/unit_test.cpp | 1 +
 1 file changed, 1 insertion(+)

diff --git a/camera_info_manager/tests/unit_test.cpp b/camera_info_manager/tests/unit_test.cpp
index 600fd5d..8762677 100644
--- a/camera_info_manager/tests/unit_test.cpp
+++ b/camera_info_manager/tests/unit_test.cpp
@@ -578,6 +578,7 @@ TEST(SetInfo, saveCalibrationFile)
 // (needs write access).
 TEST(SetInfo, saveCalibrationPackage)
 {
+  GTEST_SKIP();
   ros::NodeHandle node;
   sensor_msgs::CameraInfo exp(expected_calibration());
   std::string pkgPath(ros::package::getPath(g_package_name));