Functions | Variables
m1013x2_no_sync.cpp File Reference
#include <ros/ros.h>
#include <signal.h>
#include "dsr_util.h"
#include "dsr_robot.h"
Include dependency graph for m1013x2_no_sync.cpp:

Go to the source code of this file.

Functions

boost::mutex::scoped_lock lock (io_mutex)
 
boost::mutex::scoped_lock lock2 (io_mutex2)
 
int main (int argc, char **argv)
 
void SigHandler (int sig)
 
void thread_robot1 (ros::NodeHandle nh)
 
void thread_robot2 (ros::NodeHandle nh)
 
int WaitSignalFrom_R1 ()
 
int WaitSignalFrom_R2 ()
 
int WakeUp_R1 ()
 
int WakeUp_R2 ()
 

Variables

bool bIswait_R1 = false
 
bool bIswait_R2 = false
 
boost::condition_variable condition
 
boost::condition_variable condition2
 
boost::mutex io_mutex
 
boost::mutex io_mutex2
 
string ROBOT_ID = "dsr01"
 
string ROBOT_ID2 = "dsr02"
 
string ROBOT_MODEL = "m1013"
 
string ROBOT_MODEL2 = "m1013"
 

Function Documentation

boost::mutex::scoped_lock lock ( io_mutex  )
boost::mutex::scoped_lock lock2 ( io_mutex2  )
int main ( int  argc,
char **  argv 
)

Definition at line 176 of file m1013x2_no_sync.cpp.

void SigHandler ( int  sig)

Definition at line 150 of file m1013x2_no_sync.cpp.

void thread_robot1 ( ros::NodeHandle  nh)

r.sleep();

Definition at line 88 of file m1013x2_no_sync.cpp.

void thread_robot2 ( ros::NodeHandle  nh)

r.sleep();

Definition at line 119 of file m1013x2_no_sync.cpp.

int WaitSignalFrom_R1 ( )

Definition at line 53 of file m1013x2_no_sync.cpp.

int WaitSignalFrom_R2 ( )

Definition at line 79 of file m1013x2_no_sync.cpp.

int WakeUp_R1 ( )

Definition at line 63 of file m1013x2_no_sync.cpp.

int WakeUp_R2 ( )

Definition at line 37 of file m1013x2_no_sync.cpp.

Variable Documentation

bool bIswait_R1 = false

Definition at line 34 of file m1013x2_no_sync.cpp.

bool bIswait_R2 = false

Definition at line 35 of file m1013x2_no_sync.cpp.

Definition at line 28 of file m1013x2_no_sync.cpp.

Definition at line 32 of file m1013x2_no_sync.cpp.

boost::mutex io_mutex

Definition at line 26 of file m1013x2_no_sync.cpp.

boost::mutex io_mutex2

Definition at line 30 of file m1013x2_no_sync.cpp.

string ROBOT_ID = "dsr01"

Definition at line 19 of file m1013x2_no_sync.cpp.

string ROBOT_ID2 = "dsr02"

Definition at line 21 of file m1013x2_no_sync.cpp.

string ROBOT_MODEL = "m1013"

Definition at line 20 of file m1013x2_no_sync.cpp.

string ROBOT_MODEL2 = "m1013"

Definition at line 22 of file m1013x2_no_sync.cpp.



cpp
Author(s): Kab Kyoum Kim , Jin Hyuk Gong , Jeongwoo Lee
autogenerated on Sat May 18 2019 02:32:53