|
| template<typename Setting > |
| Setting::ValueType | sdkDefaultValue () |
| |
| template<typename Setting > |
| auto | sdkValidRange () |
| |
| template<typename ZividSettingsType , typename ConfigType > |
| void | testAcquisitionMinMaxDefault (const std::string &prefix, std::size_t num_acquisition_servers) |
| |
| template<typename ZividSettingsType , typename ConfigType > |
| void | testGeneralMinMaxDefault (const std::string &service_name) |
| |
| | TestWithFileCamera () |
| |
| template<class A , class B > |
| void | assertArrayFloatEq (const A &actual, const B &expected) const |
| |
| void | assertCameraInfoForFileCamera (const sensor_msgs::CameraInfo &ci) const |
| |
| void | assertSensorMsgsImageContents (const sensor_msgs::Image &image, const Zivid::Array2D< Zivid::ColorRGBA > &expected_rgba) |
| |
| void | assertSensorMsgsImageMeta (const sensor_msgs::Image &image, std::size_t width, std::size_t height, std::size_t bytes_per_pixel, const std::string &encoding) |
| |
| void | assertSensorMsgsPointCloud2Meta (const sensor_msgs::PointCloud2 &point_cloud, std::size_t width, std::size_t height, std::size_t point_step) |
| |
| void | enableFirst2DAcquisition () |
| |
| void | enableFirst3DAcquisition () |
| |
| void | enableFirst3DAcquisitionAndCapture () |
| |
| template<class Type > |
| SubscriptionWrapper< Type > | subscribe (const std::string &name) |
| |
| void | waitForReady () |
| |
| | ZividNodeTestBase () |
| |
Definition at line 560 of file test_zivid_camera.cpp.
template<typename Setting >
| Setting::ValueType DynamicReconfigureMinMaxDefaultTest::sdkDefaultValue |
( |
| ) |
|
|
inlineprotected |
template<typename Setting >
| auto DynamicReconfigureMinMaxDefaultTest::sdkValidRange |
( |
| ) |
|
|
inlineprotected |
template<typename ZividSettingsType , typename ConfigType >
| void DynamicReconfigureMinMaxDefaultTest::testAcquisitionMinMaxDefault |
( |
const std::string & |
prefix, |
|
|
std::size_t |
num_acquisition_servers |
|
) |
| |
|
inlineprotected |
template<typename ZividSettingsType , typename ConfigType >
| void DynamicReconfigureMinMaxDefaultTest::testGeneralMinMaxDefault |
( |
const std::string & |
service_name | ) |
|
|
inlineprotected |
The documentation for this class was generated from the following file: