|
| 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 55 of file test_zivid_camera.cpp.
template<class A , class B >
| void ZividNodeTest::assertArrayFloatEq |
( |
const A & |
actual, |
|
|
const B & |
expected |
|
) |
| const |
|
inlineprotected |
| void ZividNodeTest::assertCameraInfoForFileCamera |
( |
const sensor_msgs::CameraInfo & |
ci | ) |
const |
|
inlineprotected |
| void ZividNodeTest::assertSensorMsgsImageContents |
( |
const sensor_msgs::Image & |
image, |
|
|
const Zivid::Array2D< Zivid::ColorRGBA > & |
expected_rgba |
|
) |
| |
|
inlineprotected |
| void ZividNodeTest::assertSensorMsgsImageMeta |
( |
const sensor_msgs::Image & |
image, |
|
|
std::size_t |
width, |
|
|
std::size_t |
height, |
|
|
std::size_t |
bytes_per_pixel, |
|
|
const std::string & |
encoding |
|
) |
| |
|
inlineprotected |
| void ZividNodeTest::assertSensorMsgsPointCloud2Meta |
( |
const sensor_msgs::PointCloud2 & |
point_cloud, |
|
|
std::size_t |
width, |
|
|
std::size_t |
height, |
|
|
std::size_t |
point_step |
|
) |
| |
|
inlineprotected |
| void ZividNodeTest::enableFirst2DAcquisition |
( |
| ) |
|
|
inlineprotected |
| void ZividNodeTest::enableFirst3DAcquisition |
( |
| ) |
|
|
inlineprotected |
| void ZividNodeTest::enableFirst3DAcquisitionAndCapture |
( |
| ) |
|
|
inlineprotected |
| void ZividNodeTest::waitForReady |
( |
| ) |
|
|
inlineprotected |
| constexpr auto ZividNodeTest::capture_2d_service_name = "/zivid_camera/capture_2d" |
|
staticprotected |
| constexpr auto ZividNodeTest::capture_assistant_suggest_settings_service_name |
|
staticprotected |
Initial value:= "/zivid_camera/capture_assistant/"
"suggest_settings"
Definition at line 65 of file test_zivid_camera.cpp.
| constexpr auto ZividNodeTest::capture_service_name = "/zivid_camera/capture" |
|
staticprotected |
| constexpr auto ZividNodeTest::color_camera_info_topic_name = "/zivid_camera/color/camera_info" |
|
staticprotected |
| constexpr auto ZividNodeTest::color_image_color_topic_name = "/zivid_camera/color/image_color" |
|
staticprotected |
| constexpr auto ZividNodeTest::depth_camera_info_topic_name = "/zivid_camera/depth/camera_info" |
|
staticprotected |
| constexpr auto ZividNodeTest::depth_image_topic_name = "/zivid_camera/depth/image" |
|
staticprotected |
| const ros::Duration ZividNodeTest::dr_get_max_wait_duration { 5 } |
|
protected |
| constexpr auto ZividNodeTest::file_camera_path = "/usr/share/Zivid/data/FileCameraZividOne.zfc" |
|
staticprotected |
| const ros::Duration ZividNodeTest::node_ready_wait_duration { 15 } |
|
protected |
| constexpr size_t ZividNodeTest::num_dr_capture_servers = 10 |
|
staticprotected |
| constexpr auto ZividNodeTest::points_xyz_topic_name = "/zivid_camera/points/xyz" |
|
staticprotected |
| constexpr auto ZividNodeTest::points_xyzrgba_topic_name = "/zivid_camera/points/xyzrgba" |
|
staticprotected |
| constexpr auto ZividNodeTest::snr_camera_info_topic_name = "/zivid_camera/depth/camera_info" |
|
staticprotected |
| constexpr auto ZividNodeTest::snr_image_topic_name = "/zivid_camera/snr/image" |
|
staticprotected |
The documentation for this class was generated from the following file: