#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>

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 (DeprecatedClass, compileWarning) | |
| TEST (UrlSubstitution, invalidVariables) | |
| TEST (UrlSubstitution, emptyURL) | |
| TEST (UrlSubstitution, unmatchedDollarSigns) | |
| TEST (UrlSubstitution, rosHome) | |
| TEST (UrlSubstitution, cameraName) | |
| TEST (SetInfo, saveCalibrationPackage) | |
| TEST (SetInfo, saveCalibrationFile) | |
| TEST (SetInfo, saveCalibrationCameraName) | |
| TEST (SetInfo, saveCalibrationDefault) | |
| TEST (SetInfo, setCalibration) | |
| TEST (GetInfo, invalidLoads) | |
| TEST (GetInfo, nameChange) | |
| TEST (GetInfo, unresolvedLoads) | |
| TEST (GetInfo, fromPackageWithName) | |
| TEST (GetInfo, fromPackage) | |
| TEST (GetInfo, calibrated) | |
| TEST (GetInfo, uncalibrated) | |
| TEST (UrlValidation, invalidURLs) | |
| TEST (UrlValidation, validURLs) | |
| TEST (CameraName, invalidNames) | |
| TEST (CameraName, validNames) | |
| void check_url_substitution | ( | ros::NodeHandle | node, | |
| const std::string & | url, | |||
| const std::string & | exp_url, | |||
| const std::string & | camera_name | |||
| ) |
Definition at line 208 of file unit_test.cpp.
| void compare_calibration | ( | const sensor_msgs::CameraInfo & | exp, | |
| const sensor_msgs::CameraInfo & | ci | |||
| ) |
Definition at line 68 of file unit_test.cpp.
| void delete_default_file | ( | void | ) |
Definition at line 113 of file unit_test.cpp.
| void delete_file | ( | std::string | filename | ) |
Definition at line 103 of file unit_test.cpp.
| void delete_tmp_camera_info_directory | ( | void | ) |
Definition at line 128 of file unit_test.cpp.
| void do_system | ( | const std::string & | command | ) |
Definition at line 121 of file unit_test.cpp.
| sensor_msgs::CameraInfo expected_calibration | ( | void | ) |
Definition at line 139 of file unit_test.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 694 of file unit_test.cpp.
| void make_tmp_camera_info_directory | ( | void | ) |
Definition at line 133 of file unit_test.cpp.
| bool set_calibration | ( | ros::NodeHandle | node, | |
| const sensor_msgs::CameraInfo & | calib | |||
| ) |
Definition at line 195 of file unit_test.cpp.
| TEST | ( | DeprecatedClass | , | |
| compileWarning | ||||
| ) |
Definition at line 687 of file unit_test.cpp.
| TEST | ( | UrlSubstitution | , | |
| invalidVariables | ||||
| ) |
Definition at line 659 of file unit_test.cpp.
| TEST | ( | UrlSubstitution | , | |
| emptyURL | ||||
| ) |
Definition at line 651 of file unit_test.cpp.
| TEST | ( | UrlSubstitution | , | |
| unmatchedDollarSigns | ||||
| ) |
Definition at line 629 of file unit_test.cpp.
| TEST | ( | UrlSubstitution | , | |
| rosHome | ||||
| ) |
Definition at line 608 of file unit_test.cpp.
| TEST | ( | UrlSubstitution | , | |
| cameraName | ||||
| ) |
Definition at line 573 of file unit_test.cpp.
| TEST | ( | SetInfo | , | |
| saveCalibrationPackage | ||||
| ) |
Definition at line 538 of file unit_test.cpp.
| TEST | ( | SetInfo | , | |
| saveCalibrationFile | ||||
| ) |
Definition at line 500 of file unit_test.cpp.
| TEST | ( | SetInfo | , | |
| saveCalibrationCameraName | ||||
| ) |
Definition at line 463 of file unit_test.cpp.
| TEST | ( | SetInfo | , | |
| saveCalibrationDefault | ||||
| ) |
Definition at line 425 of file unit_test.cpp.
| TEST | ( | SetInfo | , | |
| setCalibration | ||||
| ) |
Definition at line 404 of file unit_test.cpp.
| TEST | ( | GetInfo | , | |
| invalidLoads | ||||
| ) |
Definition at line 387 of file unit_test.cpp.
| TEST | ( | GetInfo | , | |
| nameChange | ||||
| ) |
Definition at line 368 of file unit_test.cpp.
| TEST | ( | GetInfo | , | |
| unresolvedLoads | ||||
| ) |
Definition at line 349 of file unit_test.cpp.
| TEST | ( | GetInfo | , | |
| fromPackageWithName | ||||
| ) |
Definition at line 336 of file unit_test.cpp.
| TEST | ( | GetInfo | , | |
| fromPackage | ||||
| ) |
Definition at line 322 of file unit_test.cpp.
| TEST | ( | GetInfo | , | |
| calibrated | ||||
| ) |
Definition at line 302 of file unit_test.cpp.
| TEST | ( | GetInfo | , | |
| uncalibrated | ||||
| ) |
Definition at line 287 of file unit_test.cpp.
| TEST | ( | UrlValidation | , | |
| invalidURLs | ||||
| ) |
Definition at line 272 of file unit_test.cpp.
| TEST | ( | UrlValidation | , | |
| validURLs | ||||
| ) |
Definition at line 255 of file unit_test.cpp.
| TEST | ( | CameraName | , | |
| invalidNames | ||||
| ) |
Definition at line 242 of file unit_test.cpp.
| TEST | ( | CameraName | , | |
| validNames | ||||
| ) |
Definition at line 223 of file unit_test.cpp.