Class ResizeNode

Inheritance Relationships

Base Type

  • public rclcpp::Node

Class Documentation

class ResizeNode : public rclcpp::Node

Public Functions

explicit ResizeNode(const rclcpp::NodeOptions&)

Protected Functions

void connectCb()
void imageCb(sensor_msgs::msg::Image::ConstSharedPtr image_msg, sensor_msgs::msg::CameraInfo::ConstSharedPtr info_msg)

Protected Attributes

image_transport::CameraPublisher pub_image_
image_transport::CameraSubscriber sub_image_
int interpolation_
bool use_scale_
double scale_height_
double scale_width_
int height_
int width_
cv_bridge::CvImage scaled_cv_
std::mutex connect_mutex_