#include <camera_info_projection_factory.h>
Public Member Functions | |
CameraInfoProjectionFactory () | |
virtual rve_msgs::Matrix4 | makeMatrix () |
void | setCameraInfo (float cx, float cy, float fx, float fy, float width, float height) |
Private Attributes | |
float | cx_ |
float | cy_ |
float | fx_ |
float | fy_ |
float | height_ |
float | width_ |
Definition at line 38 of file camera_info_projection_factory.h.
Definition at line 35 of file camera_info_projection_factory.cpp.
Subclasses should override this to construct and return your custom projection matrix.
Implements rve_render_client::ProjectionMatrixFactory.
Definition at line 57 of file camera_info_projection_factory.cpp.
void rve_render_client::CameraInfoProjectionFactory::setCameraInfo | ( | float | cx, |
float | cy, | ||
float | fx, | ||
float | fy, | ||
float | width, | ||
float | height | ||
) |
Set the key numbers from sensor_msgs::CameraInfo. This does not use the CameraInfo message directly to keep the rve_render_client library from depending on sensor_msgs.
Definition at line 45 of file camera_info_projection_factory.cpp.
float rve_render_client::CameraInfoProjectionFactory::cx_ [private] |
Definition at line 51 of file camera_info_projection_factory.h.
float rve_render_client::CameraInfoProjectionFactory::cy_ [private] |
Definition at line 52 of file camera_info_projection_factory.h.
float rve_render_client::CameraInfoProjectionFactory::fx_ [private] |
Definition at line 53 of file camera_info_projection_factory.h.
float rve_render_client::CameraInfoProjectionFactory::fy_ [private] |
Definition at line 54 of file camera_info_projection_factory.h.
float rve_render_client::CameraInfoProjectionFactory::height_ [private] |
Definition at line 56 of file camera_info_projection_factory.h.
float rve_render_client::CameraInfoProjectionFactory::width_ [private] |
Definition at line 55 of file camera_info_projection_factory.h.