:farmer: warnings in ros_image_texture.cpp:477 (all nightly builds)
Opened this issue · 0 comments
Crola1702 commented
Description
After mark YUV encodings as deprecated, ros_image_texture.cpp showed warnings for Rolling
Reference builds (all nightlies):
- https://ci.ros2.org/view/nightly/job/nightly_linux_debug/3171/
- https://ci.ros2.org/view/nightly/job/nightly_linux-aarch64_debug/2883/
- https://ci.ros2.org/view/nightly/job/nightly_win_deb/3207/
- https://ci.ros2.org/view/nightly/job/nightly_linux-rhel_debug/2031/
- https://ci.ros2.org/view/nightly/job/nightly_linux_release/3191/
- https://ci.ros2.org/view/nightly/job/nightly_win_rel/3159/
- https://ci.ros2.org/view/nightly/job/nightly_linux-rhel_release/2009/
- https://ci.ros2.org/view/nightly/job/nightly_linux_repeated/3572/
- https://ci.ros2.org/view/nightly/job/nightly_linux-aarch64_repeated/2873/
- https://ci.ros2.org/view/nightly/job/nightly_win_rep/3468/
- https://ci.ros2.org/view/nightly/job/nightly_linux-rhel_repeated/2018/
- https://ci.ros2.org/view/packaging/job/packaging_linux/3560/
- https://ci.ros2.org/view/packaging/job/packaging_linux-aarch64/2908/
- https://ci.ros2.org/view/packaging/job/packaging_windows/3360/
- https://ci.ros2.org/view/packaging/job/packaging_linux-rhel/2059/
Warning ros_image_texture.cpp:477:
/home/jenkins-agent/workspace/nightly_linux_debug/ws/src/ros2/rviz/rviz_default_plugins/src/rviz_default_plugins/displays/image/ros_image_texture.cpp: In member function ‘rviz_default_plugins::displays::ImageData rviz_default_plugins::displays::ROSImageTexture::setFormatAndNormalizeDataIfNecessary(const std::string&, const uint8_t*, size_t)’:
/home/jenkins-agent/workspace/nightly_linux_debug/ws/src/ros2/rviz/rviz_default_plugins/src/rviz_default_plugins/displays/image/ros_image_texture.cpp:477:56: warning: ‘sensor_msgs::image_encodings::YUV422’ is deprecated: use sensor_msgs::image_encodings::UYVY [-Wdeprecated-declarations]
477 | } else if (encoding == sensor_msgs::image_encodings::YUV422) {
| ^~~~~~
In file included from /home/jenkins-agent/workspace/nightly_linux_debug/ws/src/ros2/rviz/rviz_default_plugins/src/rviz_default_plugins/displays/image/ros_image_texture.cpp:47:
/home/jenkins-agent/workspace/nightly_linux_debug/ws/install/sensor_msgs/include/sensor_msgs/sensor_msgs/image_encodings.hpp:101:12: note: declared here
101 | const char YUV422[] = "yuv422"; // deprecated
| ^~~~~~
/home/jenkins-agent/workspace/nightly_linux_debug/ws/src/ros2/rviz/rviz_default_plugins/src/rviz_default_plugins/displays/image/ros_image_texture.cpp:479:56: warning: ‘sensor_msgs::image_encodings::YUV422_YUY2’ is deprecated: use sensor_msgs::image_encodings::YUYV [-Wdeprecated-declarations]
479 | } else if (encoding == sensor_msgs::image_encodings::YUV422_YUY2) {
| ^~~~~~~~~~~
/home/jenkins-agent/workspace/nightly_linux_debug/ws/install/sensor_msgs/include/sensor_msgs/sensor_msgs/image_encodings.hpp:105:12: note: declared here
105 | const char YUV422_YUY2[] = "yuv422_yuy2"; // deprecated
| ^~~~~~~~~~~