Typedefs | Functions | Variables
ObjectDetection.cpp File Reference
#include <gtest/gtest.h>
#include <actionlib/client/simple_action_client.h>
#include <ros/package.h>
#include <ros/ros.h>
#include <sensor_msgs/Image.h>
#include <boost/thread.hpp>
#include <cv_bridge/cv_bridge.h>
#include <opencv2/core/core.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <opencv2/imgproc/imgproc.hpp>
#include <darknet_ros_msgs/CheckForObjectsAction.h>
#include <cmath>
#include <string>
Include dependency graph for ObjectDetection.cpp:

Go to the source code of this file.

Typedefs

using CheckForObjectsActionClient = actionlib::SimpleActionClient< darknet_ros_msgs::CheckForObjectsAction >
 
using CheckForObjectsActionClientPtr = std::shared_ptr< CheckForObjectsActionClient >
 

Functions

void checkForObjectsResultCB (const actionlib::SimpleClientGoalState &state, const darknet_ros_msgs::CheckForObjectsResultConstPtr &result)
 
bool sendImageToYolo (ros::NodeHandle nh, const std::string &pathToTestImage)
 
 TEST (ObjectDetection, DISABLED_DetectDog)
 
 TEST (ObjectDetection, DetectANYmal)
 
 TEST (ObjectDetection, DISABLED_DetectPerson)
 

Variables

darknet_ros_msgs::BoundingBoxes boundingBoxesResults_
 

Typedef Documentation

using CheckForObjectsActionClient = actionlib::SimpleActionClient<darknet_ros_msgs::CheckForObjectsAction>

Definition at line 30 of file ObjectDetection.cpp.

Definition at line 31 of file ObjectDetection.cpp.

Function Documentation

void checkForObjectsResultCB ( const actionlib::SimpleClientGoalState state,
const darknet_ros_msgs::CheckForObjectsResultConstPtr &  result 
)

Done-callback for CheckForObjects action client.

Parameters
[in]state
[in]result

Definition at line 50 of file ObjectDetection.cpp.

bool sendImageToYolo ( ros::NodeHandle  nh,
const std::string &  pathToTestImage 
)

Check for objects action client.

Definition at line 56 of file ObjectDetection.cpp.

TEST ( ObjectDetection  ,
DISABLED_DetectDog   
)

Definition at line 96 of file ObjectDetection.cpp.

TEST ( ObjectDetection  ,
DetectANYmal   
)

Definition at line 147 of file ObjectDetection.cpp.

TEST ( ObjectDetection  ,
DISABLED_DetectPerson   
)

Definition at line 183 of file ObjectDetection.cpp.

Variable Documentation

darknet_ros_msgs::BoundingBoxes boundingBoxesResults_

Definition at line 43 of file ObjectDetection.cpp.



darknet_ros
Author(s): Marko Bjelonic
autogenerated on Wed May 5 2021 02:58:30