31 #ifndef MAPVIZ_PLUGINS_POSE_ARRAY_PLUGIN_H_ 32 #define MAPVIZ_PLUGINS_POSE_ARRAY_PLUGIN_H_ 48 #include <geometry_msgs/PoseArray.h> 49 #include <geometry_msgs/PoseStamped.h> 54 #include "ui_pose_array_config.h" 71 void Draw(
double x,
double y,
double scale);
73 void LoadConfig(
const YAML::Node& node,
const std::string& path);
74 void SaveConfig(YAML::Emitter& emitter,
const std::string& path);
80 void PrintInfo(
const std::string& message);
88 Ui::pose_array_config
ui_;
100 #endif // MAPVIZ_PLUGINS_POSE_ARRAY_PLUGIN_H_ void LoadConfig(const YAML::Node &node, const std::string &path)
QWidget * GetConfigWidget(QWidget *parent)
ros::Subscriber pose_sub_
bool Initialize(QGLWidget *canvas)
TFSIMD_FORCE_INLINE const tfScalar & y() const
void SaveConfig(YAML::Emitter &emitter, const std::string &path)
void Draw(double x, double y, double scale)
Ui::pose_array_config ui_
TFSIMD_FORCE_INLINE const tfScalar & x() const
virtual ~PoseArrayPlugin()
void PrintInfo(const std::string &message)
void PoseArrayCallback(const geometry_msgs::PoseArrayConstPtr &msg)
void PrintWarning(const std::string &message)
void PrintError(const std::string &message)