Public Member Functions | |
NeptusParser () | |
void | neptusParserReset () |
void | parseGoto (XMLElement *maneuverType) |
void | parseLoiter (XMLElement *maneuverType) |
int | parseNeptus (string xmlFile) |
void | parseRows (XMLElement *maneuverType) |
void | parseStationKeeping (XMLElement *maneuverType) |
void | setStartPoint (auv_msgs::NED position) |
auv_msgs::NED | str2NED (string Lat, string Lon) |
Public Attributes | |
double | heading |
bool | latLonAbs |
labust::maneuver::ManeuverGenerator | MG |
auv_msgs::NED | offset |
auv_msgs::DecimalLatLon | origin |
double | speed |
sensor_msgs::NavSatFix | startPoint |
bool | startPointSet |
bool | startRelative |
bool | underactuated |
double | victory_radius |
XMLDocument | xmlDoc |
string | xmlSavePath |
Definition at line 63 of file neptus_parser.cpp.
NeptusParser::NeptusParser | ( | ) | [inline] |
Definition at line 71 of file neptus_parser.cpp.
void NeptusParser::neptusParserReset | ( | ) | [inline] |
Definition at line 83 of file neptus_parser.cpp.
void NeptusParser::parseGoto | ( | XMLElement * | maneuverType | ) | [inline] |
Definition at line 150 of file neptus_parser.cpp.
void NeptusParser::parseLoiter | ( | XMLElement * | maneuverType | ) | [inline] |
Definition at line 352 of file neptus_parser.cpp.
int NeptusParser::parseNeptus | ( | string | xmlFile | ) | [inline] |
Definition at line 94 of file neptus_parser.cpp.
void NeptusParser::parseRows | ( | XMLElement * | maneuverType | ) | [inline] |
Definition at line 194 of file neptus_parser.cpp.
void NeptusParser::parseStationKeeping | ( | XMLElement * | maneuverType | ) | [inline] |
Definition at line 324 of file neptus_parser.cpp.
void NeptusParser::setStartPoint | ( | auv_msgs::NED | position | ) | [inline] |
Definition at line 396 of file neptus_parser.cpp.
auv_msgs::NED NeptusParser::str2NED | ( | string | Lat, |
string | Lon | ||
) | [inline] |
Definition at line 360 of file neptus_parser.cpp.
double NeptusParser::heading |
Definition at line 428 of file neptus_parser.cpp.
Definition at line 423 of file neptus_parser.cpp.
Definition at line 414 of file neptus_parser.cpp.
auv_msgs::NED NeptusParser::offset |
Definition at line 420 of file neptus_parser.cpp.
auv_msgs::DecimalLatLon NeptusParser::origin |
Definition at line 418 of file neptus_parser.cpp.
double NeptusParser::speed |
Definition at line 428 of file neptus_parser.cpp.
sensor_msgs::NavSatFix NeptusParser::startPoint |
Definition at line 416 of file neptus_parser.cpp.
Definition at line 421 of file neptus_parser.cpp.
Definition at line 422 of file neptus_parser.cpp.
Definition at line 427 of file neptus_parser.cpp.
double NeptusParser::victory_radius |
Definition at line 428 of file neptus_parser.cpp.
XMLDocument NeptusParser::xmlDoc |
Definition at line 415 of file neptus_parser.cpp.
string NeptusParser::xmlSavePath |
Definition at line 424 of file neptus_parser.cpp.