Skip to content

Commit e5dc799

Browse files
authored
Removed pre-compiler check for opencv3 (#695)
Signed-off-by: Alejandro Hernández Cordero <[email protected]>
1 parent 6503d8e commit e5dc799

File tree

1 file changed

+0
-6
lines changed

1 file changed

+0
-6
lines changed

intra_process_demo/include/image_pipeline/camera_node.hpp

Lines changed: 0 additions & 6 deletions
Original file line numberDiff line numberDiff line change
@@ -47,14 +47,8 @@ class CameraNode final : public rclcpp::Node
4747
{
4848
// Initialize OpenCV
4949
cap_.open(device);
50-
// TODO(jacobperron): Remove pre-compiler check when we drop support for Xenial
51-
#if CV_MAJOR_VERSION < 3
52-
cap_.set(CV_CAP_PROP_FRAME_WIDTH, static_cast<double>(width));
53-
cap_.set(CV_CAP_PROP_FRAME_HEIGHT, static_cast<double>(height));
54-
#else
5550
cap_.set(cv::CAP_PROP_FRAME_WIDTH, static_cast<double>(width));
5651
cap_.set(cv::CAP_PROP_FRAME_HEIGHT, static_cast<double>(height));
57-
#endif
5852
if (!cap_.isOpened()) {
5953
throw std::runtime_error("Could not open video stream!");
6054
}

0 commit comments

Comments
 (0)