Skip to content

Commit

Permalink
Remove todo comment
Browse files Browse the repository at this point in the history
Signed-off-by: Yadunund <[email protected]>
  • Loading branch information
Yadunund committed Feb 3, 2023
1 parent 7717ffd commit 4fd66b3
Showing 1 changed file with 1 addition and 2 deletions.
3 changes: 1 addition & 2 deletions cv_bridge/src/cv_mat_sensor_msgs_image_type_adapter.cpp
Original file line number Diff line number Diff line change
Expand Up @@ -177,7 +177,6 @@ void
ROSCvMatContainer::get_sensor_msgs_msg_image_copy(
sensor_msgs::msg::Image & sensor_msgs_image) const
{
// TODO(YV): call convert_to_ros_message() instead?
sensor_msgs_image.height = frame_.rows;
sensor_msgs_image.width = frame_.cols;
if (encoding_override_.has_value() && !encoding_override_.value().empty())
Expand All @@ -201,7 +200,7 @@ ROSCvMatContainer::get_sensor_msgs_msg_image_copy(
break;
default:
throw std::runtime_error("unsupported encoding type");
}
}
}
sensor_msgs_image.step = static_cast<sensor_msgs::msg::Image::_step_type>(frame_.step);
size_t size = frame_.step * frame_.rows;
Expand Down

0 comments on commit 4fd66b3

Please sign in to comment.