Classes | Functions | Variables
segway_rmp_node.cpp File Reference
#include <iostream>
#include <sstream>
#include <cmath>
#include "ros/ros.h"
#include <tf/transform_broadcaster.h>
#include "geometry_msgs/Twist.h"
#include "nav_msgs/Odometry.h"
#include "segway_rmp/SegwayStatusStamped.h"
#include "segwayrmp/segwayrmp.h"
#include <boost/thread.hpp>
Include dependency graph for segway_rmp_node.cpp:

Go to the source code of this file.

Classes

class  SegwayRMPNode
 

Functions

void handleDebugMessages (const std::string &msg)
 
void handleErrorMessages (const std::string &msg)
 
void handleInfoMessages (const std::string &msg)
 
void handleStatusWrapper (segwayrmp::SegwayStatus::Ptr &ss)
 
int main (int argc, char **argv)
 

Variables

static double degrees_to_radians = M_PI / 180.0
 
static double radians_to_degrees = 180.0 / M_PI
 
static SegwayRMPNodesegwayrmp_node_instance
 

Function Documentation

void handleDebugMessages ( const std::string &  msg)

Definition at line 46 of file segway_rmp_node.cpp.

void handleErrorMessages ( const std::string &  msg)

Definition at line 48 of file segway_rmp_node.cpp.

void handleInfoMessages ( const std::string &  msg)

Definition at line 47 of file segway_rmp_node.cpp.

void handleStatusWrapper ( segwayrmp::SegwayStatus::Ptr ss)

Definition at line 640 of file segway_rmp_node.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 644 of file segway_rmp_node.cpp.

Variable Documentation

double degrees_to_radians = M_PI / 180.0
static

Definition at line 43 of file segway_rmp_node.cpp.

double radians_to_degrees = 180.0 / M_PI
static

Definition at line 42 of file segway_rmp_node.cpp.

SegwayRMPNode* segwayrmp_node_instance
static

Definition at line 38 of file segway_rmp_node.cpp.



segway_rmp
Author(s): William Woodall
autogenerated on Mon Jun 10 2019 15:04:58