17 #ifndef MOVIDIUS_NCS_STREAM_NCS_NODELET_H    18 #define MOVIDIUS_NCS_STREAM_NCS_NODELET_H    23 #include <boost/bind.hpp>    24 #include <boost/function.hpp>    27 #include <sensor_msgs/Image.h>    33 typedef boost::function<void(movidius_ncs_lib::ClassificationResultPtr result, std_msgs::Header header)> 
FUNP_C;
    34 typedef boost::function<void(movidius_ncs_lib::DetectionResultPtr result, std_msgs::Header header)> 
FUNP_D;
    46   void cbClassify(
const sensor_msgs::ImageConstPtr& image);
    47   void cbDetect(
const sensor_msgs::ImageConstPtr& image);
    76   virtual void onInit();
    82 #endif  // MOVIDIUS_NCS_STREAM_NCS_NODELET_H std::vector< float > mean_
 
std::shared_ptr< DetectionResult > DetectionResultPtr
 
boost::function< void(movidius_ncs_lib::DetectionResultPtr result, std_msgs::Header header)> FUNP_D
 
NCSImpl(ros::NodeHandle &nh, ros::NodeHandle &pnh)
 
void cbGetClassificationResult(movidius_ncs_lib::ClassificationResultPtr result, std_msgs::Header header)
 
std::string graph_file_path_
 
void cbGetDetectionResult(movidius_ncs_lib::DetectionResultPtr result, std_msgs::Header header)
 
boost::function< void(movidius_ncs_lib::ClassificationResultPtr result, std_msgs::Header header)> FUNP_C
 
std::shared_ptr< ClassificationResult > ClassificationResultPtr
 
std::shared_ptr< NCSImpl > impl_
 
void cbClassify(const sensor_msgs::ImageConstPtr &image)
 
void cbDetect(const sensor_msgs::ImageConstPtr &image)
 
image_transport::Subscriber sub_
 
std::string category_file_path_
 
std::shared_ptr< movidius_ncs_lib::NCSManager > ncs_manager_handle_