#include "hri_humans.hpp"
#include <OGRE/OgreCamera.h>
#include <OGRE/OgreManualObject.h>
#include <OGRE/OgreMaterialManager.h>
#include <OGRE/OgreRectangle2D.h>
#include <OGRE/OgreRenderSystem.h>
#include <OGRE/OgreRenderWindow.h>
#include <OGRE/OgreRoot.h>
#include <OGRE/OgreSceneManager.h>
#include <OGRE/OgreSceneNode.h>
#include <OGRE/OgreTechnique.h>
#include <OGRE/OgreTextureManager.h>
#include <OGRE/OgreViewport.h>
#include <cv_bridge/cv_bridge.h>
#include <hri_msgs/IdsList.h>
#include <hri_msgs/NormalizedPointOfInterest2D.h>
#include <hri_msgs/Skeleton2D.h>
#include <image_transport/image_transport.h>
#include <rviz/display_context.h>
#include <rviz/frame_manager.h>
#include <rviz/ogre_helpers/compatibility.h>
#include <rviz/render_panel.h>
#include <rviz/validate_floats.h>
#include <sensor_msgs/image_encodings.h>
#include <stdlib.h>
#include <boost/bind.hpp>
#include <opencv2/opencv.hpp>
#include <sstream>
#include <string>
#include <unordered_map>
#include <vector>
#include <pluginlib/class_list_macros.hpp>
Go to the source code of this file.
◆ JOINT_RADIUS
◆ SKELETON_POINTS
      
        
          | #define SKELETON_POINTS   18 | 
      
 
 
◆ clip()
      
        
          | int clip | ( | int | n, | 
        
          |  |  | int | lower, | 
        
          |  |  | int | upper | 
        
          |  | ) |  |  | 
      
 
 
◆ get_color_from_id()
      
        
          | cv::Scalar get_color_from_id | ( | std::string | id | ) |  |