Classes | Functions
utest.cpp File Reference
#include "image_geometry/pinhole_camera_model.h"
#include <sensor_msgs/distortion_models.h>
#include <gtest/gtest.h>
Include dependency graph for utest.cpp:

Go to the source code of this file.

Classes

class  PinholeTest
 

Functions

int main (int argc, char **argv)
 
 TEST_F (PinholeTest, accessorsCorrect)
 
 TEST_F (PinholeTest, getDeltas)
 
 TEST_F (PinholeTest, initialization)
 
 TEST_F (PinholeTest, projectPoint)
 
 TEST_F (PinholeTest, rectifiedRoiCaching)
 
 TEST_F (PinholeTest, rectifiedRoiSize)
 
 TEST_F (PinholeTest, rectifyIfCalibrated)
 
 TEST_F (PinholeTest, rectifyPoint)
 
 TEST_F (PinholeTest, unrectifyImage)
 
 TEST_F (PinholeTest, unrectifyImageWithBinning)
 
 TEST_F (PinholeTest, unrectifyImageWithBinningAndRoi)
 
 TEST_F (PinholeTest, unrectifyImageWithRoi)
 
void testUnrectifyImage (const sensor_msgs::CameraInfo &cam_info, const image_geometry::PinholeCameraModel &model)
 

Function Documentation

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 460 of file utest.cpp.

◆ TEST_F() [1/12]

TEST_F ( PinholeTest  ,
accessorsCorrect   
)

Definition at line 47 of file utest.cpp.

◆ TEST_F() [2/12]

TEST_F ( PinholeTest  ,
getDeltas   
)

Definition at line 135 of file utest.cpp.

◆ TEST_F() [3/12]

TEST_F ( PinholeTest  ,
initialization   
)

Definition at line 151 of file utest.cpp.

◆ TEST_F() [4/12]

TEST_F ( PinholeTest  ,
projectPoint   
)

Definition at line 56 of file utest.cpp.

◆ TEST_F() [5/12]

TEST_F ( PinholeTest  ,
rectifiedRoiCaching   
)

Definition at line 428 of file utest.cpp.

◆ TEST_F() [6/12]

TEST_F ( PinholeTest  ,
rectifiedRoiSize   
)

Definition at line 370 of file utest.cpp.

◆ TEST_F() [7/12]

TEST_F ( PinholeTest  ,
rectifyIfCalibrated   
)
Todo:
use forward distortion for a better test

Definition at line 164 of file utest.cpp.

◆ TEST_F() [8/12]

TEST_F ( PinholeTest  ,
rectifyPoint   
)
Todo:
Need R = identity for the principal point tests.

Definition at line 90 of file utest.cpp.

◆ TEST_F() [9/12]

TEST_F ( PinholeTest  ,
unrectifyImage   
)

Definition at line 330 of file utest.cpp.

◆ TEST_F() [10/12]

TEST_F ( PinholeTest  ,
unrectifyImageWithBinning   
)

Definition at line 335 of file utest.cpp.

◆ TEST_F() [11/12]

TEST_F ( PinholeTest  ,
unrectifyImageWithBinningAndRoi   
)

Definition at line 356 of file utest.cpp.

◆ TEST_F() [12/12]

TEST_F ( PinholeTest  ,
unrectifyImageWithRoi   
)

Definition at line 344 of file utest.cpp.

◆ testUnrectifyImage()

void testUnrectifyImage ( const sensor_msgs::CameraInfo &  cam_info,
const image_geometry::PinholeCameraModel model 
)

Definition at line 252 of file utest.cpp.



image_geometry
Author(s): Patrick Mihelich
autogenerated on Mon Oct 3 2022 02:45:59