$search

RosSpawnMain Class Reference

List of all members.

Public Member Functions

bool continue_node (rosspawn::NodeAction::Request &req, rosspawn::NodeAction::Response &resp)
std::string find_valid (std::string &progname)
bool fork_and_exec (std::string &progname)
pid_t get_pid (std::string &node_file_name)
std::string get_process_state (pid_t pid)
bool list_available (rosspawn::ListAvailable::Request &req, rosspawn::ListAvailable::Response &resp)
bool list_loaded (rosspawn::ListLoaded::Request &req, rosspawn::ListLoaded::Response &resp)
bool pause_node (rosspawn::NodeAction::Request &req, rosspawn::NodeAction::Response &resp)
 RosSpawnMain (ros::NodeHandle &n)
bool send_signal (std::string &node_file_name, int signum)
bool start_node (rosspawn::NodeAction::Request &req, rosspawn::NodeAction::Response &resp)
bool stop_node (rosspawn::NodeAction::Request &req, rosspawn::NodeAction::Response &resp)
void wait_thread ()
 ~RosSpawnMain ()

Private Types

typedef std::map< int,
std::pair< std::string,
std::string > > 
ChildrenMap

Private Attributes

std::list< std::string > __acceptable_modules
std::string __acceptable_modules_file
ChildrenMap __children
boost::condition_variable __children_cond
boost::mutex __children_mutex
boost::thread __children_wait_thread
ros::NodeHandle__n
ros::Publisher __pub_node_events
regex_t __re_alnum
std::list< std::string > __search_paths
ros::ServiceServer __srv_continue
ros::ServiceServer __srv_list_avail
ros::ServiceServer __srv_list_loaded
ros::ServiceServer __srv_pause
ros::ServiceServer __srv_start
ros::ServiceServer __srv_stop
bool __use_acceptable_modules_file

Detailed Description

Definition at line 56 of file rosspawn.cpp.


Member Typedef Documentation

typedef std::map<int, std::pair<std::string, std::string> > RosSpawnMain::ChildrenMap [private]

Definition at line 419 of file rosspawn.cpp.


Constructor & Destructor Documentation

RosSpawnMain::RosSpawnMain ( ros::NodeHandle n  )  [inline]

Definition at line 59 of file rosspawn.cpp.

RosSpawnMain::~RosSpawnMain (  )  [inline]

Definition at line 110 of file rosspawn.cpp.


Member Function Documentation

bool RosSpawnMain::continue_node ( rosspawn::NodeAction::Request req,
rosspawn::NodeAction::Response resp 
) [inline]

Definition at line 327 of file rosspawn.cpp.

std::string RosSpawnMain::find_valid ( std::string &  progname  )  [inline]

Definition at line 120 of file rosspawn.cpp.

bool RosSpawnMain::fork_and_exec ( std::string &  progname  )  [inline]

Definition at line 150 of file rosspawn.cpp.

pid_t RosSpawnMain::get_pid ( std::string &  node_file_name  )  [inline]

Definition at line 292 of file rosspawn.cpp.

std::string RosSpawnMain::get_process_state ( pid_t  pid  )  [inline]

Definition at line 271 of file rosspawn.cpp.

bool RosSpawnMain::list_available ( rosspawn::ListAvailable::Request req,
rosspawn::ListAvailable::Response resp 
) [inline]

Definition at line 364 of file rosspawn.cpp.

bool RosSpawnMain::list_loaded ( rosspawn::ListLoaded::Request req,
rosspawn::ListLoaded::Response resp 
) [inline]

Definition at line 354 of file rosspawn.cpp.

bool RosSpawnMain::pause_node ( rosspawn::NodeAction::Request req,
rosspawn::NodeAction::Response resp 
) [inline]

Definition at line 321 of file rosspawn.cpp.

bool RosSpawnMain::send_signal ( std::string &  node_file_name,
int  signum 
) [inline]

Definition at line 308 of file rosspawn.cpp.

bool RosSpawnMain::start_node ( rosspawn::NodeAction::Request req,
rosspawn::NodeAction::Response resp 
) [inline]

Definition at line 302 of file rosspawn.cpp.

bool RosSpawnMain::stop_node ( rosspawn::NodeAction::Request req,
rosspawn::NodeAction::Response resp 
) [inline]

Definition at line 333 of file rosspawn.cpp.

void RosSpawnMain::wait_thread (  )  [inline]

Definition at line 189 of file rosspawn.cpp.


Member Data Documentation

std::list<std::string> RosSpawnMain::__acceptable_modules [private]

Definition at line 427 of file rosspawn.cpp.

Definition at line 426 of file rosspawn.cpp.

Definition at line 420 of file rosspawn.cpp.

boost::condition_variable RosSpawnMain::__children_cond [private]

Definition at line 422 of file rosspawn.cpp.

boost::mutex RosSpawnMain::__children_mutex [private]

Definition at line 421 of file rosspawn.cpp.

boost::thread RosSpawnMain::__children_wait_thread [private]

Definition at line 423 of file rosspawn.cpp.

Definition at line 408 of file rosspawn.cpp.

Definition at line 409 of file rosspawn.cpp.

regex_t RosSpawnMain::__re_alnum [private]

Definition at line 429 of file rosspawn.cpp.

std::list<std::string> RosSpawnMain::__search_paths [private]

Definition at line 417 of file rosspawn.cpp.

Definition at line 413 of file rosspawn.cpp.

Definition at line 415 of file rosspawn.cpp.

Definition at line 414 of file rosspawn.cpp.

Definition at line 412 of file rosspawn.cpp.

Definition at line 410 of file rosspawn.cpp.

Definition at line 411 of file rosspawn.cpp.

Definition at line 425 of file rosspawn.cpp.


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


rosspawn
Author(s): Tim Niemueller
autogenerated on Tue Mar 5 12:27:11 2013