pax_global_header 0000666 0000000 0000000 00000000064 12533052066 0014514 g ustar 00root root 0000000 0000000 52 comment=89fa35d7bf7d2e71c1247e03e93945e5b56823c9
ros-bond-core-1.7.16/ 0000775 0000000 0000000 00000000000 12533052066 0014261 5 ustar 00root root 0000000 0000000 ros-bond-core-1.7.16/.gitignore 0000664 0000000 0000000 00000000006 12533052066 0016245 0 ustar 00root root 0000000 0000000 *.pyc
ros-bond-core-1.7.16/bond/ 0000775 0000000 0000000 00000000000 12533052066 0015203 5 ustar 00root root 0000000 0000000 ros-bond-core-1.7.16/bond/BondSM.sm 0000664 0000000 0000000 00000001635 12533052066 0016673 0 ustar 00root root 0000000 0000000 // -*- tab-width: 4; -*-
%start SM::WaitingForSister
%class BondSM
%header bondcpp/bond.h
%map SM
%%
// Transition End State Action(s)
WaitingForSister {
SisterAlive Alive { Connected(); }
SisterDead Dead { Connected(); SisterDied(); Death(); }
ConnectTimeout Dead { Death(); }
Die Dead { Death(); }
}
Alive {
SisterAlive Alive { Heartbeat(); }
SisterDead Dead { SisterDied(); Death(); }
HeartbeatTimeout Dead { Death(); }
Die AwaitSisterDeath { StartDying(); }
}
AwaitSisterDeath {
SisterAlive AwaitSisterDeath {}
HeartbeatTimeout AwaitSisterDeath {}
Die AwaitSisterDeath {}
SisterDead Dead { Death(); }
DisconnectTimeout Dead { Death(); }
}
Dead {
SisterAlive Dead {}
SisterDead Dead {}
DisconnectTimeout Dead {}
HeartbeatTimeout Dead {}
ConnectTimeout Dead {}
Die Dead {}
}
%%
ros-bond-core-1.7.16/bond/CMakeLists.txt 0000664 0000000 0000000 00000000432 12533052066 0017742 0 ustar 00root root 0000000 0000000 cmake_minimum_required(VERSION 2.8.3)
project(bond)
find_package(catkin REQUIRED message_generation std_msgs)
add_message_files(DIRECTORY msg
FILES
Constants.msg
Status.msg
)
generate_messages(DEPENDENCIES std_msgs)
catkin_package(CATKIN_DEPENDS message_runtime std_msgs)
ros-bond-core-1.7.16/bond/mainpage.dox 0000664 0000000 0000000 00000001106 12533052066 0017476 0 ustar 00root root 0000000 0000000 /**
\mainpage
\htmlinclude manifest.html
\b link is ...
\section codeapi Code API
*/
ros-bond-core-1.7.16/bond/msg/ 0000775 0000000 0000000 00000000000 12533052066 0015771 5 ustar 00root root 0000000 0000000 ros-bond-core-1.7.16/bond/msg/Constants.msg 0000664 0000000 0000000 00000000411 12533052066 0020451 0 ustar 00root root 0000000 0000000 float32 DEAD_PUBLISH_PERIOD = 0.05
float32 DEFAULT_CONNECT_TIMEOUT = 10.0
float32 DEFAULT_HEARTBEAT_TIMEOUT = 4.0
float32 DEFAULT_DISCONNECT_TIMEOUT = 2.0
float32 DEFAULT_HEARTBEAT_PERIOD = 1.0
string DISABLE_HEARTBEAT_TIMEOUT_PARAM=/bond_disable_heartbeat_timeout ros-bond-core-1.7.16/bond/msg/Status.msg 0000664 0000000 0000000 00000000411 12533052066 0017760 0 ustar 00root root 0000000 0000000 Header header
string id # ID of the bond
string instance_id # Unique ID for an individual in a bond
bool active
# Including the timeouts for the bond makes it easier to debug mis-matches
# between the two sides.
float32 heartbeat_timeout
float32 heartbeat_period ros-bond-core-1.7.16/bond/package.xml 0000664 0000000 0000000 00000001634 12533052066 0017324 0 ustar 00root root 0000000 0000000
bond
1.7.16
A bond allows two processes, A and B, to know when the other has
terminated, either cleanly or by crashing. The bond remains
connected until it is either broken explicitly or until a
heartbeat times out.
Stuart Glaser
Esteve Fernandez
BSD
http://www.ros.org/wiki/bond
https://github.com/ros/bond_core/issues
https://github.com/ros/bond_core
catkin
message_generation
std_msgs
message_runtime
std_msgs
ros-bond-core-1.7.16/bond_core/ 0000775 0000000 0000000 00000000000 12533052066 0016213 5 ustar 00root root 0000000 0000000 ros-bond-core-1.7.16/bond_core/CMakeLists.txt 0000664 0000000 0000000 00000000154 12533052066 0020753 0 ustar 00root root 0000000 0000000 cmake_minimum_required(VERSION 2.8.3)
project(bond_core)
find_package(catkin REQUIRED)
catkin_metapackage()
ros-bond-core-1.7.16/bond_core/package.xml 0000664 0000000 0000000 00000001610 12533052066 0020326 0 ustar 00root root 0000000 0000000
bond_core
1.7.16
A bond allows two processes, A and B, to know when the other has
terminated, either cleanly or by crashing. The bond remains
connected until it is either broken explicitly or until a
heartbeat times out.
Esteve Fernandez
BSD
http://www.ros.org/wiki/bond_core
https://github.com/ros/bond_core/issues
https://github.com/ros/bond_core
Stu Glaser
catkin
bond
bondcpp
bondpy
smclib