30 #ifndef MAPVIZ_PLUGINS_PATH_PLUGIN_H_    31 #define MAPVIZ_PLUGINS_PATH_PLUGIN_H_    47 #include <nav_msgs/Path.h>    53 #include "ui_path_config.h"    70     void Draw(
double x, 
double y, 
double scale);
    72     void LoadConfig(
const YAML::Node& node, 
const std::string& path);
    73     void SaveConfig(YAML::Emitter& emitter, 
const std::string& path);
    79     void PrintInfo(
const std::string& message);
    99 #endif  // MAPVIZ_PLUGINS_PATH_PLUGIN_H_ 
void PrintInfo(const std::string &message)
ros::Subscriber path_sub_
bool Initialize(QGLWidget *canvas)
void PrintWarning(const std::string &message)
QWidget * GetConfigWidget(QWidget *parent)
void SaveConfig(YAML::Emitter &emitter, const std::string &path)
void LoadConfig(const YAML::Node &node, const std::string &path)
void pathCallback(const nav_msgs::PathConstPtr &path)
void PrintError(const std::string &message)
void Draw(double x, double y, double scale)