int jsk_rviz_plugins::addFont | ( | unsigned char * | data, |
unsigned int | data_len | ||
) |
Definition at line 53 of file pictogram_display.cpp.
bool jsk_rviz_plugins::epsEqual | ( | double | a, |
double | b | ||
) |
Definition at line 69 of file pictogram_display.cpp.
QFont jsk_rviz_plugins::getFont | ( | std::string | character | ) |
Definition at line 84 of file pictogram_display.cpp.
bool jsk_rviz_plugins::isCharacterSupported | ( | std::string | character | ) |
Definition at line 74 of file pictogram_display.cpp.
bool jsk_rviz_plugins::isEntypo | ( | std::string | text | ) |
Definition at line 114 of file pictogram_display.cpp.
bool jsk_rviz_plugins::isFontAwesome | ( | std::string | text | ) |
Definition at line 121 of file pictogram_display.cpp.
QString jsk_rviz_plugins::lookupPictogramText | ( | std::string | character | ) |
Definition at line 99 of file pictogram_display.cpp.
static geometry_msgs::Point jsk_rviz_plugins::pointOgreToMsg | ( | const Ogre::Vector3 & | o | ) | [inline, static] |
Definition at line 83 of file tablet_view_controller.cpp.
static void jsk_rviz_plugins::pointOgreToMsg | ( | const Ogre::Vector3 & | o, |
geometry_msgs::Point & | m | ||
) | [inline, static] |
Definition at line 89 of file tablet_view_controller.cpp.
void jsk_rviz_plugins::setupFont | ( | ) |
Definition at line 42 of file pictogram_font_mapping.h.
bool jsk_rviz_plugins::validateFloats | ( | const sensor_msgs::CameraInfo & | msg | ) |
Definition at line 78 of file overlay_camera_display.cpp.
bool jsk_rviz_plugins::validateFloats | ( | const jsk_recognition_msgs::PolygonArray & | msg | ) |
Definition at line 141 of file polygon_array_display.cpp.
bool jsk_rviz_plugins::validateFloats | ( | const geometry_msgs::PoseArray & | msg | ) |
Definition at line 148 of file pose_array_display.cpp.
static Ogre::Vector3 jsk_rviz_plugins::vectorFromMsg | ( | const geometry_msgs::Point & | m | ) | [inline, static] |
Definition at line 81 of file tablet_view_controller.cpp.
static Ogre::Vector3 jsk_rviz_plugins::vectorFromMsg | ( | const geometry_msgs::Vector3 & | m | ) | [inline, static] |
Definition at line 82 of file tablet_view_controller.cpp.
static geometry_msgs::Vector3 jsk_rviz_plugins::vectorOgreToMsg | ( | const Ogre::Vector3 & | o | ) | [inline, static] |
Definition at line 91 of file tablet_view_controller.cpp.
static void jsk_rviz_plugins::vectorOgreToMsg | ( | const Ogre::Vector3 & | o, |
geometry_msgs::Vector3 & | m | ||
) | [inline, static] |
Definition at line 97 of file tablet_view_controller.cpp.
const double jsk_rviz_plugins::animate_duration = 0.2 |
Definition at line 55 of file overlay_menu_display.cpp.
const float jsk_rviz_plugins::arrow_animation_duration = 1.0 |
Definition at line 47 of file facing_visualizer.cpp.
std::map<std::string, QString> jsk_rviz_plugins::entypo_character_map |
Definition at line 39 of file pictogram_font_mapping.h.
std::map<std::string, QString> jsk_rviz_plugins::entypo_social_character_map |
Definition at line 40 of file pictogram_font_mapping.h.
std::map<std::string, QString> jsk_rviz_plugins::fontawesome_character_map |
Definition at line 41 of file pictogram_font_mapping.h.
const int jsk_rviz_plugins::menu_last_padding_y = 30 |
Definition at line 54 of file overlay_menu_display.cpp.
const int jsk_rviz_plugins::menu_padding_x = 100 |
Definition at line 52 of file overlay_menu_display.cpp.
const int jsk_rviz_plugins::menu_padding_y = 5 |
Definition at line 53 of file overlay_menu_display.cpp.
const double jsk_rviz_plugins::minimum_font_size = 0.2 |
Definition at line 46 of file facing_visualizer.cpp.
const std::string jsk_rviz_plugins::MODE_FPS = "FPS" [static] |
Definition at line 71 of file tablet_view_controller.cpp.
const std::string jsk_rviz_plugins::MODE_ORBIT = "Orbit" [static] |
Definition at line 70 of file tablet_view_controller.cpp.
const double jsk_rviz_plugins::overlay_diagnostic_animation_duration = 5.0 |
Definition at line 51 of file overlay_diagnostic_display.cpp.
const double jsk_rviz_plugins::overlay_diagnostic_animation_transition_duration = 0.2 |
Definition at line 52 of file overlay_diagnostic_display.cpp.
const Ogre::Radian jsk_rviz_plugins::PITCH_LIMIT_HIGH = Ogre::Radian( Ogre::Math::PI - 0.02) [static] |
Definition at line 77 of file tablet_view_controller.cpp.
const Ogre::Radian jsk_rviz_plugins::PITCH_LIMIT_LOW = Ogre::Radian( 0.02 ) [static] |
Definition at line 76 of file tablet_view_controller.cpp.