All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends
Public Types | Public Slots | Signals | Public Member Functions | Public Attributes
segbot_controller::QNode Class Reference

#include <qnode.hpp>

List of all members.

Public Types

enum  LogLevel {
  Debug, Info, Warn, Error,
  Fatal
}

Public Slots

void cont ()
void stop ()

Signals

void loggingUpdated ()
void rosShutdown ()

Public Member Functions

void goalpub (const geometry_msgs::PoseStamped::ConstPtr msg)
bool init ()
bool init (const std::string &master_url, const std::string &host_url)
void log (const LogLevel &level, const std::string &msg)
QStringListModel * loggingModel ()
 QNode (int argc, char **argv)
void run ()
void stopmsg (const geometry_msgs::PoseStamped::ConstPtr msg)
virtual ~QNode ()

Public Attributes

boost::shared_ptr
< actionlib::SimpleActionClient
< move_base_msgs::MoveBaseAction > > 
client
int init_argc
char ** init_argv
QStringListModel logging_model
boost::shared_ptr
< move_base_msgs::MoveBaseGoal > 
mostRecentGoal
boost::shared_ptr
< ros::Subscriber
sub

Detailed Description

Definition at line 37 of file qnode.hpp.


Member Enumeration Documentation

Enumerator:
Debug 
Info 
Warn 
Error 
Fatal 

Definition at line 51 of file qnode.hpp.


Constructor & Destructor Documentation

segbot_controller::QNode::QNode ( int  argc,
char **  argv 
)

Definition at line 31 of file qnode.cpp.

Definition at line 39 of file qnode.cpp.


Member Function Documentation

Definition at line 83 of file qnode.cpp.

void segbot_controller::QNode::goalpub ( const geometry_msgs::PoseStamped::ConstPtr  msg)

Definition at line 47 of file qnode.cpp.

Definition at line 61 of file qnode.cpp.

bool segbot_controller::QNode::init ( const std::string &  master_url,
const std::string &  host_url 
)
void segbot_controller::QNode::log ( const LogLevel level,
const std::string &  msg 
)

Definition at line 96 of file qnode.cpp.

QStringListModel* segbot_controller::QNode::loggingModel ( ) [inline]

Definition at line 59 of file qnode.hpp.

Definition at line 89 of file qnode.cpp.

Definition at line 77 of file qnode.cpp.

void segbot_controller::QNode::stopmsg ( const geometry_msgs::PoseStamped::ConstPtr  msg)

Member Data Documentation

boost::shared_ptr<actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> > segbot_controller::QNode::client

Definition at line 75 of file qnode.hpp.

Definition at line 71 of file qnode.hpp.

Definition at line 72 of file qnode.hpp.

Definition at line 74 of file qnode.hpp.

boost::shared_ptr<move_base_msgs::MoveBaseGoal> segbot_controller::QNode::mostRecentGoal

Definition at line 76 of file qnode.hpp.

Definition at line 73 of file qnode.hpp.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Friends


segbot_controller
Author(s): lab
autogenerated on Sun Mar 24 2013 17:17:27