Namespaces | |
overlay_text_interface | |
Functions | |
int | addFont (unsigned char *data, unsigned int data_len) |
bool | epsEqual (double a, double b) |
QFont | getFont (std::string character) |
bool | isCharacterSupported (std::string character) |
bool | isEntypo (std::string text) |
bool | isFontAwesome (std::string text) |
QString | lookupPictogramText (std::string character) |
static geometry_msgs::Point | pointOgreToMsg (const Ogre::Vector3 &o) |
static void | pointOgreToMsg (const Ogre::Vector3 &o, geometry_msgs::Point &m) |
void | setupFont () |
bool | validateFloats (const geometry_msgs::PoseArray &msg) |
bool | validateFloats (const jsk_recognition_msgs::PolygonArray &msg) |
bool | validateFloats (const sensor_msgs::CameraInfo &msg) |
static Ogre::Vector3 | vectorFromMsg (const geometry_msgs::Point &m) |
static Ogre::Vector3 | vectorFromMsg (const geometry_msgs::Vector3 &m) |
static geometry_msgs::Vector3 | vectorOgreToMsg (const Ogre::Vector3 &o) |
static void | vectorOgreToMsg (const Ogre::Vector3 &o, geometry_msgs::Vector3 &m) |
Variables | |
const double | animate_duration = 0.2 |
const float | arrow_animation_duration = 1.0 |
std::map< std::string, QString > | entypo_character_map |
std::map< std::string, QString > | entypo_social_character_map |
std::map< std::string, QString > | fontawesome_character_map |
const int | menu_last_padding_y = 30 |
const int | menu_padding_x = 100 |
const int | menu_padding_y = 5 |
const double | minimum_font_size = 0.2 |
static const std::string | MODE_FPS = "FPS" |
static const std::string | MODE_ORBIT = "Orbit" |
const double | overlay_diagnostic_animation_duration = 5.0 |
const double | overlay_diagnostic_animation_transition_duration = 0.2 |
static const Ogre::Radian | PITCH_LIMIT_HIGH = Ogre::Radian( Ogre::Math::PI - 0.02) |
static const Ogre::Radian | PITCH_LIMIT_LOW = Ogre::Radian( 0.02 ) |
int jsk_rviz_plugins::addFont | ( | unsigned char * | data, |
unsigned int | data_len | ||
) |
Definition at line 85 of file pictogram_display.cpp.
bool jsk_rviz_plugins::epsEqual | ( | double | a, |
double | b | ||
) |
Definition at line 99 of file pictogram_display.cpp.
QFont jsk_rviz_plugins::getFont | ( | std::string | character | ) |
Definition at line 114 of file pictogram_display.cpp.
bool jsk_rviz_plugins::isCharacterSupported | ( | std::string | character | ) |
Definition at line 104 of file pictogram_display.cpp.
bool jsk_rviz_plugins::isEntypo | ( | std::string | text | ) |
Definition at line 144 of file pictogram_display.cpp.
bool jsk_rviz_plugins::isFontAwesome | ( | std::string | text | ) |
Definition at line 151 of file pictogram_display.cpp.
QString jsk_rviz_plugins::lookupPictogramText | ( | std::string | character | ) |
Definition at line 129 of file pictogram_display.cpp.
|
inlinestatic |
Definition at line 83 of file tablet_view_controller.cpp.
|
inlinestatic |
Definition at line 89 of file tablet_view_controller.cpp.
void jsk_rviz_plugins::setupFont | ( | ) |
Definition at line 74 of file pictogram_font_mapping.h.
bool jsk_rviz_plugins::validateFloats | ( | const geometry_msgs::PoseArray & | msg | ) |
Definition at line 151 of file pose_array_display.cpp.
bool jsk_rviz_plugins::validateFloats | ( | const jsk_recognition_msgs::PolygonArray & | msg | ) |
Definition at line 142 of file polygon_array_display.cpp.
bool jsk_rviz_plugins::validateFloats | ( | const sensor_msgs::CameraInfo & | msg | ) |
Definition at line 110 of file overlay_camera_display.cpp.
|
inlinestatic |
Definition at line 81 of file tablet_view_controller.cpp.
|
inlinestatic |
Definition at line 82 of file tablet_view_controller.cpp.
|
inlinestatic |
Definition at line 91 of file tablet_view_controller.cpp.
|
inlinestatic |
Definition at line 97 of file tablet_view_controller.cpp.
const double jsk_rviz_plugins.animate_duration = 0.2 |
Definition at line 87 of file overlay_menu_display.cpp.
const float jsk_rviz_plugins::arrow_animation_duration = 1.0 |
Definition at line 79 of file facing_visualizer.cpp.
std::map<std::string, QString> jsk_rviz_plugins.entypo_character_map |
Definition at line 71 of file pictogram_font_mapping.h.
std::map<std::string, QString> jsk_rviz_plugins.entypo_social_character_map |
Definition at line 72 of file pictogram_font_mapping.h.
std::map<std::string, QString> jsk_rviz_plugins.fontawesome_character_map |
Definition at line 73 of file pictogram_font_mapping.h.
const int jsk_rviz_plugins.menu_last_padding_y = 30 |
Definition at line 86 of file overlay_menu_display.cpp.
const int jsk_rviz_plugins.menu_padding_x = 100 |
Definition at line 84 of file overlay_menu_display.cpp.
const int jsk_rviz_plugins.menu_padding_y = 5 |
Definition at line 85 of file overlay_menu_display.cpp.
const double jsk_rviz_plugins::minimum_font_size = 0.2 |
Definition at line 78 of file facing_visualizer.cpp.
|
static |
Definition at line 71 of file tablet_view_controller.cpp.
|
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 83 of file overlay_diagnostic_display.cpp.
const double jsk_rviz_plugins.overlay_diagnostic_animation_transition_duration = 0.2 |
Definition at line 84 of file overlay_diagnostic_display.cpp.
|
static |
Definition at line 77 of file tablet_view_controller.cpp.
|
static |
Definition at line 76 of file tablet_view_controller.cpp.