Skip to content

Commit 84dc9a0

Browse files
committed
fix pragma spacing
Signed-off-by: Tully Foote <tfoote@osrfoundation.org>
1 parent 7550e8a commit 84dc9a0

File tree

1 file changed

+1
-1
lines changed

1 file changed

+1
-1
lines changed

‎sensor_msgs/include/sensor_msgs/point_cloud_conversion.hpp‎

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -46,7 +46,7 @@
4646
#define POINT_CLOUD_DEPRECATION_MESSAGE PointCloud is deprecated as of Foxy to be removed after. \
4747
Please use sensor_msgs/PointCloud2. This header will be removed too.
4848
#ifdef _MSC_VER
49-
#pragma message (POINT_CLOUD_DEPRECATION_MESSAGE)
49+
#pragma message(POINT_CLOUD_DEPRECATION_MESSAGE)
5050
#else
5151
#ifndef RCUTILS_SKIP_WARNING
5252
#warning POINT_CLOUD_DEPRECATION_MESSAGE

0 commit comments

Comments
 (0)