ObjectDetectionVisualizer::ObjectDetectionVisualizer |
( |
ros::NodeHandle & |
nh | ) |
|
|
inline |
ObjectDetectionVisualizer::~ObjectDetectionVisualizer |
( |
| ) |
|
|
inline |
bool ObjectDetectionVisualizer::convertImageMessageToMat |
( |
const sensor_msgs::Image::ConstPtr & |
image_msg, |
|
|
cv_bridge::CvImageConstPtr & |
image_ptr, |
|
|
cv::Mat & |
image |
|
) |
| |
|
inlineprivate |
bool ObjectDetectionVisualizer::convertPclMessageToMat |
( |
const sensor_msgs::PointCloud2::ConstPtr & |
pointcloud_msg, |
|
|
pcl::PointCloud< pcl::PointXYZRGB > & |
pointcloud, |
|
|
cv::Mat & |
color_image |
|
) |
| |
|
inlineprivate |
void ObjectDetectionVisualizer::detectionImageCallback |
( |
const cob_object_detection_msgs::DetectionArray::ConstPtr & |
object_detection_msg, |
|
|
const sensor_msgs::PointCloud2::ConstPtr & |
pointcloud_msg |
|
) |
| |
|
inlineprivate |
bool ObjectDetectionVisualizer::drawDetectedModel3D |
( |
cv::Mat |
image, |
|
|
const std::vector< cv::Point > & |
corners_2d, |
|
|
const cv::Scalar & |
color |
|
) |
| |
|
inlineprivate |
void ObjectDetectionVisualizer::objectDetectionArrayCallback |
( |
const cob_object_detection_msgs::DetectionArray::ConstPtr & |
object_detection_msg | ) |
|
|
inlineprivate |
void ObjectDetectionVisualizer::objectDetectionDisplayCallback |
( |
const cob_object_detection_msgs::DetectionArray::ConstPtr & |
object_detection_msg | ) |
|
|
inlineprivate |
void ObjectDetectionVisualizer::pointcloudCallback |
( |
const sensor_msgs::PointCloud2::ConstPtr & |
pointcloud_msg | ) |
|
|
inlineprivate |
void ObjectDetectionVisualizer::pointcloudInfoCallback |
( |
const sensor_msgs::CameraInfoConstPtr & |
data | ) |
|
|
inlineprivate |
cv::Point ObjectDetectionVisualizer::projectPoint |
( |
const cv::Vec3d & |
point_3d | ) |
|
|
inlineprivate |
bool ObjectDetectionVisualizer::renderDetections |
( |
cv::Mat & |
image, |
|
|
const cob_object_detection_msgs::DetectionArray::ConstPtr & |
object_detection_msg |
|
) |
| |
|
inlineprivate |
cv::Mat ObjectDetectionVisualizer::color_image_ |
|
private |
boost::mutex ObjectDetectionVisualizer::color_image_mutex_ |
|
private |
bool ObjectDetectionVisualizer::display_detection_image_ |
|
private |
bool ObjectDetectionVisualizer::display_rviz_markers_ |
|
private |
int ObjectDetectionVisualizer::image_counter_ |
|
private |
visualization_msgs::MarkerArray ObjectDetectionVisualizer::marker_array_msg_ |
|
private |
std::map<std::string, cv::Scalar> ObjectDetectionVisualizer::object_name_to_color_map_ |
|
private |
unsigned int ObjectDetectionVisualizer::prev_marker_array_size_ |
|
private |
cv::Mat ObjectDetectionVisualizer::projection_matrix_ |
|
private |
bool ObjectDetectionVisualizer::projection_matrix_received_ |
|
private |
The documentation for this class was generated from the following file: