Go to the documentation of this file.
22 #include <geometry_msgs/Point.h>
25 #include <sensor_msgs/Image.h>
27 #include <std_msgs/Header.h>
31 #include <opencv2/highgui/highgui.hpp>
32 #include <opencv2/imgproc/imgproc.hpp>
33 #include <opencv2/objdetect/objdetect.hpp>
36 #include <darknet_ros_msgs/BoundingBox.h>
37 #include <darknet_ros_msgs/BoundingBoxes.h>
38 #include <darknet_ros_msgs/CheckForObjectsAction.h>
39 #include <darknet_ros_msgs/ObjectCount.h>
43 #include "cublas_v2.h"
44 #include "cuda_runtime.h"
51 #include "cost_layer.h"
52 #include "detection_layer.h"
55 #include "region_layer.h"
64 extern "C" int show_image(image p,
const char* name,
int ms);
70 float x,
y, w, h, prob;
233 void setupNetwork(
char* cfgfile,
char* weightfile,
char* datafile,
float thresh,
char** names,
int classes,
int delay,
char* prefix,
234 int avg_frames,
float hier,
int w,
int h,
int frames,
int fullscreen);
int frameWidth_
Camera related parameters.
void rememberNetwork(network *net)
bool getImageStatus(void)
boost::shared_mutex mutexImageCallback_
ros::Publisher boundingBoxesPublisher_
ros::NodeHandle nodeHandle_
ROS node handle.
bool publishDetectionImage(const cv::Mat &detectionImage)
void * displayLoop(void *ptr)
void checkForObjectsActionGoalCB()
std::vector< std::string > classLabels_
YoloObjectDetector(ros::NodeHandle nh)
CvMatWithHeader_ getCvMatWithHeader()
darknet_ros_msgs::BoundingBoxes boundingBoxesResults_
CheckForObjectsActionServerPtr checkForObjectsActionServer_
Check for objects action server.
boost::shared_mutex mutexNodeStatus_
std::vector< int > rosBoxCounter_
bool isCheckingForObjects() const
image_transport::Subscriber imageSubscriber_
ROS subscriber and publisher.
std_msgs::Header imageHeader_
int sizeNetwork(network *net)
Bounding box of the detected object.
detection * avgPredictions(network *net, int *nboxes)
ros::Publisher objectPublisher_
std::vector< std::vector< RosBox_ > > rosBoxes_
Detected objects.
boost::shared_mutex mutexImageStatus_
int show_image(image p, const char *name, int ms)
image mat_to_image(cv::Mat m)
image_transport::ImageTransport imageTransport_
Advertise and subscribe to image topics.
std::shared_ptr< CheckForObjectsActionServer > CheckForObjectsActionServerPtr
ros::Publisher detectionImagePublisher_
Publisher of the bounding box image.
cv::Mat image_to_mat(image im)
bool enableConsoleOutput_
std_msgs::Header headerBuff_[3]
int numClasses_
Class labels.
void * displayInThread(void *ptr)
boost::shared_mutex mutexActionStatus_
void cameraCallback(const sensor_msgs::ImageConstPtr &msg)
void * detectLoop(void *ptr)
void checkForObjectsActionPreemptCB()
void setupNetwork(char *cfgfile, char *weightfile, char *datafile, float thresh, char **names, int classes, int delay, char *prefix, int avg_frames, float hier, int w, int h, int frames, int fullscreen)
darknet_ros
Author(s): Marko Bjelonic
autogenerated on Wed Mar 2 2022 00:10:00