From 4c27ca51bd28089f2d41494bc1b01003755bd0d4 Mon Sep 17 00:00:00 2001 From: Tully Foote Date: Wed, 15 Apr 2020 03:25:33 -0700 Subject: [PATCH] fix pragma spacing Signed-off-by: Tully Foote --- sensor_msgs/include/sensor_msgs/point_cloud_conversion.hpp | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/sensor_msgs/include/sensor_msgs/point_cloud_conversion.hpp b/sensor_msgs/include/sensor_msgs/point_cloud_conversion.hpp index 487bb1e5..433a9bcd 100644 --- a/sensor_msgs/include/sensor_msgs/point_cloud_conversion.hpp +++ b/sensor_msgs/include/sensor_msgs/point_cloud_conversion.hpp @@ -46,7 +46,7 @@ #define POINT_CLOUD_DEPRECATION_MESSAGE PointCloud is deprecated as of Foxy to be removed after. \ Please use sensor_msgs/PointCloud2. This header will be removed too. #ifdef _MSC_VER -#pragma message (POINT_CLOUD_DEPRECATION_MESSAGE) +#pragma message(POINT_CLOUD_DEPRECATION_MESSAGE) #else #ifndef RCUTILS_SKIP_WARNING #warning POINT_CLOUD_DEPRECATION_MESSAGE