Functions
unit_test.cpp File Reference
#include <unistd.h>
#include <stdlib.h>
#include <ros/ros.h>
#include <ros/package.h>
#include "camera_info_manager/camera_info_manager.h"
#include <sensor_msgs/distortion_models.h>
#include <string>
#include <gtest/gtest.h>
Include dependency graph for unit_test.cpp:

Go to the source code of this file.

Functions

void check_url_substitution (ros::NodeHandle node, const std::string &url, const std::string &exp_url, const std::string &camera_name)
 
void compare_calibration (const sensor_msgs::CameraInfo &exp, const sensor_msgs::CameraInfo &ci)
 
void delete_default_file (void)
 
void delete_file (std::string filename)
 
void delete_tmp_camera_info_directory (void)
 
void do_system (const std::string &command)
 
sensor_msgs::CameraInfo expected_calibration (void)
 
int main (int argc, char **argv)
 
void make_tmp_camera_info_directory (void)
 
bool set_calibration (ros::NodeHandle node, const sensor_msgs::CameraInfo &calib)
 
 TEST (CameraName, invalidNames)
 
 TEST (CameraName, validNames)
 
 TEST (GetInfo, calibrated)
 
 TEST (GetInfo, fromPackage)
 
 TEST (GetInfo, fromPackageWithName)
 
 TEST (GetInfo, invalidLoads)
 
 TEST (GetInfo, nameChange)
 
 TEST (GetInfo, uncalibrated)
 
 TEST (GetInfo, unresolvedLoads)
 
 TEST (SetInfo, saveCalibrationCameraName)
 
 TEST (SetInfo, saveCalibrationDefault)
 
 TEST (SetInfo, saveCalibrationFile)
 
 TEST (SetInfo, saveCalibrationPackage)
 
 TEST (SetInfo, setCalibration)
 
 TEST (SetInfo, setCameraInfo)
 
 TEST (UrlSubstitution, cameraName)
 
 TEST (UrlSubstitution, emptyURL)
 
 TEST (UrlSubstitution, invalidVariables)
 
 TEST (UrlSubstitution, rosHome)
 
 TEST (UrlSubstitution, unmatchedDollarSigns)
 
 TEST (UrlValidation, invalidURLs)
 
 TEST (UrlValidation, validURLs)
 

Function Documentation

◆ check_url_substitution()

void check_url_substitution ( ros::NodeHandle  node,
const std::string &  url,
const std::string &  exp_url,
const std::string &  camera_name 
)

Definition at line 227 of file unit_test.cpp.

◆ compare_calibration()

void compare_calibration ( const sensor_msgs::CameraInfo &  exp,
const sensor_msgs::CameraInfo &  ci 
)

Definition at line 68 of file unit_test.cpp.

◆ delete_default_file()

void delete_default_file ( void  )

Definition at line 124 of file unit_test.cpp.

◆ delete_file()

void delete_file ( std::string  filename)

Definition at line 114 of file unit_test.cpp.

◆ delete_tmp_camera_info_directory()

void delete_tmp_camera_info_directory ( void  )

Definition at line 139 of file unit_test.cpp.

◆ do_system()

void do_system ( const std::string &  command)

Definition at line 132 of file unit_test.cpp.

◆ expected_calibration()

sensor_msgs::CameraInfo expected_calibration ( void  )

Definition at line 150 of file unit_test.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 727 of file unit_test.cpp.

◆ make_tmp_camera_info_directory()

void make_tmp_camera_info_directory ( void  )

Definition at line 144 of file unit_test.cpp.

◆ set_calibration()

bool set_calibration ( ros::NodeHandle  node,
const sensor_msgs::CameraInfo &  calib 
)

Definition at line 214 of file unit_test.cpp.

◆ TEST() [1/22]

TEST ( CameraName  ,
invalidNames   
)

Definition at line 261 of file unit_test.cpp.

◆ TEST() [2/22]

TEST ( CameraName  ,
validNames   
)

Definition at line 242 of file unit_test.cpp.

◆ TEST() [3/22]

TEST ( GetInfo  ,
calibrated   
)

Definition at line 321 of file unit_test.cpp.

◆ TEST() [4/22]

TEST ( GetInfo  ,
fromPackage   
)

Definition at line 341 of file unit_test.cpp.

◆ TEST() [5/22]

TEST ( GetInfo  ,
fromPackageWithName   
)

Definition at line 355 of file unit_test.cpp.

◆ TEST() [6/22]

TEST ( GetInfo  ,
invalidLoads   
)

Definition at line 406 of file unit_test.cpp.

◆ TEST() [7/22]

TEST ( GetInfo  ,
nameChange   
)

Definition at line 387 of file unit_test.cpp.

◆ TEST() [8/22]

TEST ( GetInfo  ,
uncalibrated   
)

Definition at line 306 of file unit_test.cpp.

◆ TEST() [9/22]

TEST ( GetInfo  ,
unresolvedLoads   
)

Definition at line 368 of file unit_test.cpp.

◆ TEST() [10/22]

TEST ( SetInfo  ,
saveCalibrationCameraName   
)

Definition at line 504 of file unit_test.cpp.

◆ TEST() [11/22]

TEST ( SetInfo  ,
saveCalibrationDefault   
)

Definition at line 466 of file unit_test.cpp.

◆ TEST() [12/22]

TEST ( SetInfo  ,
saveCalibrationFile   
)

Definition at line 541 of file unit_test.cpp.

◆ TEST() [13/22]

TEST ( SetInfo  ,
saveCalibrationPackage   
)

Definition at line 579 of file unit_test.cpp.

◆ TEST() [14/22]

TEST ( SetInfo  ,
setCalibration   
)

Definition at line 445 of file unit_test.cpp.

◆ TEST() [15/22]

TEST ( SetInfo  ,
setCameraInfo   
)

Definition at line 423 of file unit_test.cpp.

◆ TEST() [16/22]

TEST ( UrlSubstitution  ,
cameraName   
)

Definition at line 614 of file unit_test.cpp.

◆ TEST() [17/22]

TEST ( UrlSubstitution  ,
emptyURL   
)

Definition at line 692 of file unit_test.cpp.

◆ TEST() [18/22]

TEST ( UrlSubstitution  ,
invalidVariables   
)

Definition at line 700 of file unit_test.cpp.

◆ TEST() [19/22]

TEST ( UrlSubstitution  ,
rosHome   
)

Definition at line 649 of file unit_test.cpp.

◆ TEST() [20/22]

TEST ( UrlSubstitution  ,
unmatchedDollarSigns   
)

Definition at line 670 of file unit_test.cpp.

◆ TEST() [21/22]

TEST ( UrlValidation  ,
invalidURLs   
)

Definition at line 291 of file unit_test.cpp.

◆ TEST() [22/22]

TEST ( UrlValidation  ,
validURLs   
)

Definition at line 274 of file unit_test.cpp.



camera_info_manager
Author(s): Jack O'Quin
autogenerated on Sat Jan 20 2024 03:14:54