, including all inherited members.
| CalcExteriorOrientation(std::map< int, T > &container, Pose *pose, int type_id=-1) | alvar::CameraEC | [inline] |
| CalcExteriorOrientation(std::map< int, T > &container, Pose *pose, F do_handle_test) | alvar::CameraEC | [inline] |
| alvar::Camera::CalcExteriorOrientation(std::vector< CvPoint3D64f > &pw, std::vector< CvPoint2D64f > &pi, Pose *pose) | alvar::Camera | |
| alvar::Camera::CalcExteriorOrientation(std::vector< CvPoint3D64f > &pw, std::vector< PointDouble > &pi, CvMat *rodriques, CvMat *tra) | alvar::Camera | |
| alvar::Camera::CalcExteriorOrientation(std::vector< PointDouble > &pw, std::vector< PointDouble > &pi, CvMat *rodriques, CvMat *tra) | alvar::Camera | |
| alvar::Camera::CalcExteriorOrientation(std::vector< PointDouble > &pw, std::vector< PointDouble > &pi, Pose *pose) | alvar::Camera | |
| alvar::Camera::CalcExteriorOrientation(const CvMat *object_points, CvMat *image_points, Pose *pose) | alvar::Camera | |
| alvar::Camera::CalcExteriorOrientation(const CvMat *object_points, CvMat *image_points, CvMat *rodriques, CvMat *tra) | alvar::Camera | |
| calib_D | alvar::Camera | |
| calib_D_data | alvar::Camera | |
| calib_K | alvar::Camera | |
| calib_K_data | alvar::Camera | |
| calib_x_res | alvar::Camera | |
| calib_y_res | alvar::Camera | |
| Calibrate(ProjPoints &pp) | alvar::Camera | |
| cam_info_ | alvar::Camera | [protected] |
| Camera() | alvar::Camera | |
| Camera(ros::NodeHandle &n, std::string cam_info_topic) | alvar::Camera | |
| cameraInfoTopic_ | alvar::Camera | [protected] |
| camInfoCallback(const sensor_msgs::CameraInfoConstPtr &) | alvar::Camera | [protected] |
| Distort(std::map< int, T > &container, int type_id=-1) | alvar::CameraEC | [inline] |
| Distort(std::map< int, T > &container, F &do_handle_test) | alvar::CameraEC | [inline] |
| alvar::Camera::Distort(CvPoint2D32f &point) | alvar::Camera | |
| alvar::Camera::Distort(std::vector< PointDouble > &points) | alvar::Camera | |
| alvar::Camera::Distort(PointDouble &point) | alvar::Camera | |
| EraseUsingReprojectionError(std::map< int, T > &container, float reprojection_error_limit, int type_id=-1, Pose *pose=0) | alvar::CameraEC | [inline] |
| Get3dOnDepth(const Pose *pose, CvPoint2D32f p2d, float depth, CvPoint3D32f &p3d) | alvar::CameraEC | |
| Get3dOnPlane(const Pose *pose, CvPoint2D32f p2d, CvPoint3D32f &p3d) | alvar::CameraEC | |
| getCamInfo_ | alvar::Camera | |
| GetFovX() | alvar::Camera | [inline] |
| GetFovY() | alvar::Camera | [inline] |
| GetOpenglProjectionMatrix(double proj_matrix[16], const int width, const int height, const float far_clip=1000.0f, const float near_clip=0.1f) | alvar::Camera | |
| n_ | alvar::Camera | [protected] |
| ProjectPoint(const CvPoint3D64f pw, const Pose *pose, CvPoint2D64f &pi) const | alvar::Camera | |
| ProjectPoint(const CvPoint3D32f pw, const Pose *pose, CvPoint2D32f &pi) const | alvar::Camera | |
| ProjectPoints(std::vector< CvPoint3D64f > &pw, Pose *pose, std::vector< CvPoint2D64f > &pi) const | alvar::Camera | |
| ProjectPoints(const CvMat *object_points, const CvMat *rotation_vector, const CvMat *translation_vector, CvMat *image_points) const | alvar::Camera | |
| ProjectPoints(const CvMat *object_points, double gl[16], CvMat *image_points) const | alvar::Camera | |
| ProjectPoints(const CvMat *object_points, const Pose *pose, CvMat *image_points) const | alvar::Camera | |
| ReconstructFeature(const Pose *pose1, const Pose *pose2, const CvPoint2D32f *u1, const CvPoint2D32f *u2, CvPoint3D32f *p3d, double limit) | alvar::CameraEC | |
| Reproject(std::map< int, T > &container, Pose *pose, int type_id=-1, bool needs_has_p2d=false, bool needs_has_p3d=false, float average_outlier_limit=0.f) | alvar::CameraEC | [inline] |
| Reproject(std::map< int, T > &container, Pose *pose, F do_handle_test, float average_outlier_limit=0.f) | alvar::CameraEC | [inline] |
| SaveCalib(const char *calibfile, FILE_FORMAT format=FILE_FORMAT_DEFAULT) | alvar::Camera | |
| Serialize(Serialization *ser) | alvar::Camera | [inline] |
| SerializeId() | alvar::Camera | [inline] |
| SetCalib(const char *calibfile, int _x_res, int _y_res, FILE_FORMAT format=FILE_FORMAT_DEFAULT) | alvar::Camera | |
| SetOpenglProjectionMatrix(double proj_matrix[16], const int width, const int height) | alvar::Camera | |
| SetRes(int _x_res, int _y_res) | alvar::Camera | |
| SetSimpleCalib(int _x_res, int _y_res, double f_fac=1.) | alvar::Camera | |
| sub_ | alvar::Camera | [protected] |
| Undistort(std::map< int, T > &container, int type_id=-1) | alvar::CameraEC | [inline] |
| Undistort(std::map< int, T > &container, F &do_handle_test) | alvar::CameraEC | [inline] |
| alvar::Camera::Undistort(std::vector< PointDouble > &points) | alvar::Camera | |
| alvar::Camera::Undistort(PointDouble &point) | alvar::Camera | |
| alvar::Camera::Undistort(CvPoint2D32f &point) | alvar::Camera | |
| UpdatePose(std::map< int, T > &container, Pose *pose, int type_id=-1, std::map< int, double > *weights=0) | alvar::CameraEC | [inline] |
| UpdatePose(std::map< int, T > &container, Pose *pose, F do_handle_test, std::map< int, double > *weights=0) | alvar::CameraEC | [inline] |
| UpdatePose(const CvMat *object_points, CvMat *image_points, Pose *pose, CvMat *weights=0) | alvar::CameraEC | |
| UpdatePose(const CvMat *object_points, CvMat *image_points, CvMat *rodriques, CvMat *tra, CvMat *weights=0) | alvar::CameraEC | |
| UpdateRotation(std::map< int, T > &container, Pose *pose, int type_id=-1) | alvar::CameraEC | [inline] |
| UpdateRotation(std::map< int, T > &container, Pose *pose, F do_handle_test) | alvar::CameraEC | [inline] |
| UpdateRotation(const CvMat *object_points, CvMat *image_points, Pose *pose) | alvar::CameraEC | |
| UpdateRotation(const CvMat *object_points, CvMat *image_points, CvMat *rot, CvMat *tra) | alvar::CameraEC | |
| x_res | alvar::Camera | |
| y_res | alvar::Camera | |