#include <kml/engine.h>
#include <kml/dom.h>
#include <std_msgs/String.h>
#include <std_msgs/Float64MultiArray.h>
#include <ros/ros.h>
#include <boost/bind.hpp>
#include <fstream>
Go to the source code of this file.
Classes | |
class | PlacemarkFilter |
Functions | |
int | main (int argc, char *argv[]) |
void | onUploadRequest (ros::Publisher &kmlout, const std_msgs::String::ConstPtr &path) |
void | readKml (std::ifstream &input_file, std::string &kmlfile) |
int main | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 143 of file kml_upload.cpp.
void onUploadRequest | ( | ros::Publisher & | kmlout, |
const std_msgs::String::ConstPtr & | path | ||
) |
Definition at line 111 of file kml_upload.cpp.
void readKml | ( | std::ifstream & | input_file, |
std::string & | kmlfile | ||
) |
Definition at line 99 of file kml_upload.cpp.