Classes | |
struct | BBox |
struct | ClassificationResult |
struct | DetectionResult |
class | Device |
class | ExceptionUtil |
class | Graph |
struct | ImageFrame |
struct | Item |
struct | ItemInBBox |
struct | MvncAggressiveThermal |
struct | MvncBusy |
struct | MvncDeviceNotFound |
struct | MvncError |
struct | MvncException |
struct | MvncGone |
struct | MvncHighThermal |
struct | MvncInvalidParameters |
struct | MvncMvCmdNotFound |
struct | MvncMyriadError |
struct | MvncNoData |
struct | MvncOutOfMemory |
struct | MvncThermalException |
struct | MvncTimeout |
struct | MvncUnsupportedGraphFile |
class | NCS |
struct | NCSException |
struct | NCSGraphException |
struct | NCSGraphFileError |
struct | NCSInputSizeError |
struct | NCSInputSizeFileError |
struct | NCSLoadCategoriesError |
class | NCSManager |
struct | NCSMeanAndStddevError |
class | Result |
class | Tensor |
Typedefs | |
using | ClassificationResultPtr = std::shared_ptr< ClassificationResult > |
using | DetectionResultPtr = std::shared_ptr< DetectionResult > |
typedef boost::function< void(ClassificationResultPtr result, std_msgs::Header header)> | FUNP_C |
typedef boost::function< void(DetectionResultPtr result, std_msgs::Header header)> | FUNP_D |
using | ItemInBBoxArray = std::vector< ItemInBBox > |
using | ItemInBBoxArrayPtr = std::shared_ptr< ItemInBBoxArray > |
using | Items = std::vector< Item > |
using | ItemsPtr = std::shared_ptr< Items > |
Functions | |
void | join (std::thread &t) |
Variables | |
std::map< int, std::string > | CODE2STR |
using movidius_ncs_lib::ClassificationResultPtr = typedef std::shared_ptr<ClassificationResult> |
using movidius_ncs_lib::DetectionResultPtr = typedef std::shared_ptr<DetectionResult> |
typedef boost::function<void(ClassificationResultPtr result, std_msgs::Header header)> movidius_ncs_lib::FUNP_C |
Definition at line 37 of file ncs_manager.h.
typedef boost::function<void(DetectionResultPtr result, std_msgs::Header header)> movidius_ncs_lib::FUNP_D |
Definition at line 38 of file ncs_manager.h.
using movidius_ncs_lib::ItemInBBoxArray = typedef std::vector<ItemInBBox> |
using movidius_ncs_lib::ItemInBBoxArrayPtr = typedef std::shared_ptr<ItemInBBoxArray> |
using movidius_ncs_lib::Items = typedef std::vector<Item> |
using movidius_ncs_lib::ItemsPtr = typedef std::shared_ptr<Items> |
void movidius_ncs_lib::join | ( | std::thread & | t | ) |
Definition at line 73 of file ncs_manager.cpp.
std::map<int, std::string> movidius_ncs_lib::CODE2STR |
Definition at line 26 of file exception_util.cpp.