File tree Expand file tree Collapse file tree 1 file changed +0
-2
lines changed Expand file tree Collapse file tree 1 file changed +0
-2
lines changed Original file line number Diff line number Diff line change @@ -174,7 +174,6 @@ std::string Publisher::getTopic() const
174
174
void Publisher::publish (const sensor_msgs::msg::Image & message) const
175
175
{
176
176
if (!impl_ || !impl_->isValid ()) {
177
- // TODO(ros2) Switch to RCUTILS_ASSERT when ros2/rcutils#112 is merged
178
177
auto logger = impl_ ? impl_->logger_ : rclcpp::get_logger (" image_transport" );
179
178
RCLCPP_FATAL (logger, " Call to publish() on an invalid image_transport::Publisher" );
180
179
return ;
@@ -190,7 +189,6 @@ void Publisher::publish(const sensor_msgs::msg::Image & message) const
190
189
void Publisher::publish (const sensor_msgs::msg::Image::ConstSharedPtr & message) const
191
190
{
192
191
if (!impl_ || !impl_->isValid ()) {
193
- // TODO(ros2) Switch to RCUTILS_ASSERT when ros2/rcutils#112 is merged
194
192
auto logger = impl_ ? impl_->logger_ : rclcpp::get_logger (" image_transport" );
195
193
RCLCPP_FATAL (logger, " Call to publish() on an invalid image_transport::Publisher" );
196
194
return ;
You can’t perform that action at this time.
0 commit comments