Public Member Functions | |
| ImageRotater (ros::NodeHandle nh=ros::NodeHandle()) | |
Private Member Functions | |
| void | connectCb (const image_transport::SingleSubscriberPublisher &ssp) |
| void | disconnectCb (const image_transport::SingleSubscriberPublisher &) |
| void | do_work (const sensor_msgs::ImageConstPtr &msg, const std::string input_frame_from_msg) |
| const std::string & | frameWithDefault (const std::string &frame, const std::string &image_frame) |
| void | imageCallback (const sensor_msgs::ImageConstPtr &msg) |
| void | imageCallbackWithInfo (const sensor_msgs::ImageConstPtr &msg, const sensor_msgs::CameraInfoConstPtr &cam_info) |
| void | reconfigureCallback (image_rotate::ImageRotateConfig &new_config, uint32_t level) |
| void | subscribe () |
| void | unsubscribe () |
Private Attributes | |
| double | angle_ |
| sensor_msgs::CvBridge | bridge_ |
| image_transport::CameraSubscriber | cam_sub_ |
| image_rotate::ImageRotateConfig | config_ |
| image_transport::Publisher | img_pub_ |
| image_transport::Subscriber | img_sub_ |
| image_transport::ImageTransport | it_ |
| ros::NodeHandle | nh_ |
| ros::Time | prev_stamp_ |
| tf::Stamped< tf::Vector3 > | source_vector_ |
| dynamic_reconfigure::Server < image_rotate::ImageRotateConfig > | srv |
| int | subscriber_count_ |
| tf::Stamped< tf::Vector3 > | target_vector_ |
| tf::TransformBroadcaster | tf_pub_ |
| tf::TransformListener | tf_sub_ |
Definition at line 11 of file image_rotate.cpp.
| ImageRotater::ImageRotater | ( | ros::NodeHandle | nh = ros::NodeHandle() |
) | [inline] |
Definition at line 213 of file image_rotate.cpp.
| void ImageRotater::connectCb | ( | const image_transport::SingleSubscriberPublisher & | ssp | ) | [inline, private] |
Definition at line 197 of file image_rotate.cpp.
| void ImageRotater::disconnectCb | ( | const image_transport::SingleSubscriberPublisher & | ) | [inline, private] |
Definition at line 204 of file image_rotate.cpp.
| void ImageRotater::do_work | ( | const sensor_msgs::ImageConstPtr & | msg, | |
| const std::string | input_frame_from_msg | |||
| ) | [inline, private] |
Definition at line 61 of file image_rotate.cpp.
| const std::string& ImageRotater::frameWithDefault | ( | const std::string & | frame, | |
| const std::string & | image_frame | |||
| ) | [inline, private] |
Definition at line 44 of file image_rotate.cpp.
| void ImageRotater::imageCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline, private] |
Definition at line 56 of file image_rotate.cpp.
| void ImageRotater::imageCallbackWithInfo | ( | const sensor_msgs::ImageConstPtr & | msg, | |
| const sensor_msgs::CameraInfoConstPtr & | cam_info | |||
| ) | [inline, private] |
Definition at line 51 of file image_rotate.cpp.
| void ImageRotater::reconfigureCallback | ( | image_rotate::ImageRotateConfig & | new_config, | |
| uint32_t | level | |||
| ) | [inline, private] |
Definition at line 32 of file image_rotate.cpp.
| void ImageRotater::subscribe | ( | ) | [inline, private] |
Definition at line 181 of file image_rotate.cpp.
| void ImageRotater::unsubscribe | ( | ) | [inline, private] |
Definition at line 190 of file image_rotate.cpp.
double ImageRotater::angle_ [private] |
Definition at line 29 of file image_rotate.cpp.
sensor_msgs::CvBridge ImageRotater::bridge_ [private] |
Definition at line 20 of file image_rotate.cpp.
image_transport::CameraSubscriber ImageRotater::cam_sub_ [private] |
Definition at line 18 of file image_rotate.cpp.
Definition at line 13 of file image_rotate.cpp.
image_transport::Publisher ImageRotater::img_pub_ [private] |
Definition at line 16 of file image_rotate.cpp.
image_transport::Subscriber ImageRotater::img_sub_ [private] |
Definition at line 17 of file image_rotate.cpp.
image_transport::ImageTransport ImageRotater::it_ [private] |
Definition at line 25 of file image_rotate.cpp.
ros::NodeHandle ImageRotater::nh_ [private] |
Definition at line 26 of file image_rotate.cpp.
ros::Time ImageRotater::prev_stamp_ [private] |
Definition at line 30 of file image_rotate.cpp.
tf::Stamped<tf::Vector3> ImageRotater::source_vector_ [private] |
Definition at line 23 of file image_rotate.cpp.
dynamic_reconfigure::Server<image_rotate::ImageRotateConfig> ImageRotater::srv [private] |
Definition at line 14 of file image_rotate.cpp.
int ImageRotater::subscriber_count_ [private] |
Definition at line 28 of file image_rotate.cpp.
tf::Stamped<tf::Vector3> ImageRotater::target_vector_ [private] |
Definition at line 22 of file image_rotate.cpp.
tf::TransformBroadcaster ImageRotater::tf_pub_ [private] |
Definition at line 11 of file image_rotate.cpp.
tf::TransformListener ImageRotater::tf_sub_ [private] |
Definition at line 10 of file image_rotate.cpp.