20 #include <gtest/gtest.h>    25 #include <object_msgs/ObjectInBox.h>    26 #include <object_msgs/ObjectsInBoxes.h>    30 void syncCb(
const sensor_msgs::ImageConstPtr& img,
    31             const object_msgs::ObjectsInBoxes::ConstPtr& objs_in_boxes)
    38 TEST(UnitTestStreamClassification, testClassification)
    41   std::string camera, camera_topic;
    45     camera_topic = 
"/usb_cam/image_raw";
    47   else if (camera == 
"realsense")
    49     camera_topic = 
"/camera/color/image_raw";
    55                                                                         "/movidius_ncs_nodelet/detected_objects",
    65 int main(
int argc, 
char** argv)
    67   testing::InitGoogleTest(&argc, argv);
    68   ros::init(argc, argv, 
"movidius_ncs_stream_tests");
    69   return RUN_ALL_TESTS();
 
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
 
int main(int argc, char **argv)
 
ROSCPP_DECL void spin(Spinner &spinner)
 
Connection registerCallback(C &callback)
 
void syncCb(const sensor_msgs::ImageConstPtr &img, const object_msgs::ObjectsInBoxes::ConstPtr &objs_in_boxes)
 
bool getParam(const std::string &key, std::string &s) const 
 
TEST(UnitTestStreamClassification, testClassification)
 
ROSCPP_DECL void shutdown()