#include "mapviz_plugins/point_click_publisher_plugin.h"
#include <geometry_msgs/PointStamped.h>
#include <swri_transform_util/frames.h>
#include <swri_yaml_util/yaml_util.h>
#include <boost/shared_ptr.hpp>
#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Functions | |
PLUGINLIB_DECLARE_CLASS (mapviz_plugins, point_click_publisher, mapviz_plugins::PointClickPublisherPlugin, mapviz::MapvizPlugin) namespace mapviz_plugins |
PLUGINLIB_DECLARE_CLASS | ( | mapviz_plugins | , |
point_click_publisher | , | ||
mapviz_plugins::PointClickPublisherPlugin | , | ||
mapviz::MapvizPlugin | |||
) |
Definition at line 39 of file point_click_publisher_plugin.cpp.