#include <VisualizationManager.h>
Public Member Functions | |
void | show (const cv::Mat &image, const std::string &text="", bool hold=false) |
VisualizationManager (ros::Publisher &pub) | |
~VisualizationManager () | |
Protected Member Functions | |
void | putText (cv::Mat &image, const std::string &text, const cv::Scalar &color) const |
Protected Attributes | |
sensor_msgs::CvBridge | m_bridge |
bool | m_holding |
ros::Publisher | m_publisher |
DUtils::Timestamp | m_unfreeze_time |
Definition at line 42 of file VisualizationManager.h.
Creates the visualization manager attached to the publisher it must send the images through
pub | publisher |
Definition at line 44 of file VisualizationManager.cpp.
Definition at line 51 of file VisualizationManager.cpp.
void VisualizationManager::putText | ( | cv::Mat & | image, |
const std::string & | text, | ||
const cv::Scalar & | color | ||
) | const [protected] |
Puts text in the bottom part of the image
image | |
text |
Definition at line 119 of file VisualizationManager.cpp.
void VisualizationManager::show | ( | const cv::Mat & | image, |
const std::string & | text = "" , |
||
bool | hold = false |
||
) |
Sends the given image through the publishing topic
image | |
hold | if true, image is frozen for a short time |
Definition at line 57 of file VisualizationManager.cpp.
sensor_msgs::CvBridge VisualizationManager::m_bridge [protected] |
Definition at line 73 of file VisualizationManager.h.
bool VisualizationManager::m_holding [protected] |
Definition at line 75 of file VisualizationManager.h.
ros::Publisher VisualizationManager::m_publisher [protected] |
Definition at line 72 of file VisualizationManager.h.
Definition at line 76 of file VisualizationManager.h.