18 #include <visualization_msgs/Marker.h> 19 #include <visualization_msgs/MarkerArray.h> 25 #include <boost/shared_ptr.hpp> 31 #include <ISM/RecognitionResult.hpp> 45 class ISMVisualization {
69 void drawTesselatedSphere(
float panMin,
float panMax,
float tiltMin,
float tiltMax);
72 void drawFoV(
float pan,
float tilt,
float foVX,
float foVY);
75 void drawRecognitionResult(ISM::RecognitionResultPtr result,
int level, ISM::PointPtr parentPoint, std::string prefix,
unsigned char action);
78 void drawQuads(
float panMin,
float panMax,
float tiltMin,
float tiltMax);
84 void drawUnfoundObjectsVotes();
89 ISM::PointPtr applyLevelToPoint(ISM::PointPtr p,
int level);
92 visualization_msgs::Marker pointToSphere(ISM::PointPtr point,
unsigned char action);
95 visualization_msgs::Marker lineBetweenPoints(ISM::PointPtr point1, ISM::PointPtr point2,
unsigned char action);
98 visualization_msgs::Marker arrowBetweenPoints(
const ISM::PointPtr& point1,
const ISM::PointPtr& point2,
unsigned char action);
101 visualization_msgs::Marker arrowBetweenPoints2(
const ISM::PointPtr& point1,
const ISM::PointPtr& point2);
104 geometry_msgs::Point pointToPointMsg(ISM::PointPtr point);
107 std_msgs::ColorRGBA confidenceToColor(
double confidence);
110 geometry_msgs::Point angleToPTU(
float pan,
float tilt,
float r);
116 Eigen::Vector2f getQuadExtent(Eigen::Vector2f pos,
float r,
float panSize = 5,
float tiltSize = 5);
static const int ID_SAMPLES_3D
static const int ID_PTU_FOV
static const int ID_SAMPLES_2D
static const int GRID_SCALE
boost::shared_ptr< ISMVisualization > ISMVisualizationPtr
static const int ID_TESSELLATED_SPHERE
static const int TS_RADIUS
static const int ID_QUADS