Public Member Functions | Static Public Member Functions | Static Public Attributes | Static Private Member Functions
Logging Class Reference

#include <Logging.h>

List of all members.

Public Member Functions

 Logging ()
 Logging (const Logging &orig)
virtual ~Logging ()

Static Public Member Functions

static void createLogFile (std::list< std::string > *table, std::string *filename)
static bool createLogPath ()
static void decreaseProperty (std::string prop_name)
static void decreaseProperty (std::string prop_name, uint32_t value)
static uint32_t getProperty (std::string prog_name)
static void increaseProperty (std::string prop_name)
static void increaseProperty (std::string prop_name, uint32_t value)
static void init (ros::NodeHandle *n, std::string *robot_name)
static void log ()
static void logMcPacketsSummary (unsigned long interval_ms)
static void logMemoryConsumptionPackets (unsigned long interval_ms, boost::mutex *mtx_pack, list< Packet > *packets, boost::mutex *mtx_cached_mc, list< Packet > *cached_mc, boost::mutex *mtx_unack_link_frames, list< stc_frame > *unack_link_frames, boost::mutex *mtx_unack_cr_frames, list< ack_cr_info > *unack_cr_frames)
static void logRoutingTable (std::list< routing_entry > *u_entries, std::list< McTree * > *m_entries)
static void logRRequestInitiater (route_request *req, routing_entry *route)
static void logRRequestIntermediate (RouteRequest *r)
static void logRRequestReceiver (std::string h_src, uint32_t id, uint16_t counter, uint16_t hobs, bool selected, std::list< mac > path_l)
static void logServiceCalls (string service_name, unsigned long time_call, unsigned long time_res, unsigned long size, bool ret_val)
static void logTransportFrame (stc_RoutedFrame *f, routing_entry *route, unsigned long start_time, unsigned long end_time, bool success)
static void logUcLinkTransmission (stc_frame f)
static void logUcPacketsSummary (unsigned long interval_ms)
static void periodicLog (unsigned long interval_ms)
static void safeLogs ()

Static Public Attributes

static std::list< std::string > entries_link_frames
static std::list< std::string > entries_mc_frames
static std::list< std::string > entries_mem_consumption
static std::list< std::string > entries_r_table
static std::list< std::string > entries_rreq_initi
static std::list< std::string > entries_rreq_interm
static std::list< std::string > entries_rreq_recv
static std::list< std::string > entries_service_calls
static std::list< std::string > entries_transport_frames
static std::list< std::string > entries_uc_frames
static std::string link_frames_file = "unicast_link_transmission.csv"
static std::string log_path = ""
static std::string mc_frames_file = "multicast.csv"
static std::string mem_consumption_file = "packet_memory_consumption.csv"
static boost::mutex mtx_logging
static ros::NodeHandlen = NULL
static std::string * robot_name = NULL
static std::string route_req_dst_file = "rreq_receiver.csv"
static std::string route_req_iterm_file = "rreq_intermediate.csv"
static std::string route_req_src_file = "rreq_initiater.csv"
static std::string routing_table_file = "routing_table.csv"
static std::string sercice_calls_file = "services.csv"
static std::string transport_frames_file = "transport_frames.csv"
static std::string uc_frames_file = "unicast_datalink_transmission_summary.csv"
static std::map< std::string,
uint32_t > 
uint32_properties

Static Private Member Functions

static bool removeRouteRequestReceiver (RouteResponse *res)

Detailed Description

Definition at line 17 of file Logging.h.


Constructor & Destructor Documentation

Definition at line 17 of file Logging.cpp.

Logging::Logging ( const Logging orig)

Definition at line 22 of file Logging.cpp.

Logging::~Logging ( ) [virtual]

Definition at line 27 of file Logging.cpp.


Member Function Documentation

void Logging::createLogFile ( std::list< std::string > *  table,
std::string *  filename 
) [static]

Definition at line 380 of file Logging.cpp.

bool Logging::createLogPath ( ) [static]

Definition at line 399 of file Logging.cpp.

void Logging::decreaseProperty ( std::string  prop_name) [static]

Definition at line 821 of file Logging.cpp.

void Logging::decreaseProperty ( std::string  prop_name,
uint32_t  value 
) [static]

Definition at line 826 of file Logging.cpp.

uint32_t Logging::getProperty ( std::string  prog_name) [static]

Definition at line 835 of file Logging.cpp.

void Logging::increaseProperty ( std::string  prop_name) [static]

Definition at line 808 of file Logging.cpp.

void Logging::increaseProperty ( std::string  prop_name,
uint32_t  value 
) [static]

Definition at line 813 of file Logging.cpp.

void Logging::init ( ros::NodeHandle n,
std::string *  robot_name 
) [static]

Definition at line 41 of file Logging.cpp.

void Logging::log ( ) [static]

Definition at line 348 of file Logging.cpp.

void Logging::logMcPacketsSummary ( unsigned long  interval_ms) [static]

Definition at line 218 of file Logging.cpp.

void Logging::logMemoryConsumptionPackets ( unsigned long  interval_ms,
boost::mutex *  mtx_pack,
list< Packet > *  packets,
boost::mutex *  mtx_cached_mc,
list< Packet > *  cached_mc,
boost::mutex *  mtx_unack_link_frames,
list< stc_frame > *  unack_link_frames,
boost::mutex *  mtx_unack_cr_frames,
list< ack_cr_info > *  unack_cr_frames 
) [static]

Definition at line 652 of file Logging.cpp.

void Logging::logRoutingTable ( std::list< routing_entry > *  u_entries,
std::list< McTree * > *  m_entries 
) [static]

Definition at line 424 of file Logging.cpp.

void Logging::logRRequestInitiater ( route_request req,
routing_entry route 
) [static]

Definition at line 467 of file Logging.cpp.

Definition at line 532 of file Logging.cpp.

void Logging::logRRequestReceiver ( std::string  h_src,
uint32_t  id,
uint16_t  counter,
uint16_t  hobs,
bool  selected,
std::list< mac path_l 
) [static]

Definition at line 564 of file Logging.cpp.

void Logging::logServiceCalls ( string  service_name,
unsigned long  time_call,
unsigned long  time_res,
unsigned long  size,
bool  ret_val 
) [static]

Definition at line 462 of file Logging.cpp.

void Logging::logTransportFrame ( stc_RoutedFrame f,
routing_entry route,
unsigned long  start_time,
unsigned long  end_time,
bool  success 
) [static]

Definition at line 738 of file Logging.cpp.

Definition at line 775 of file Logging.cpp.

void Logging::logUcPacketsSummary ( unsigned long  interval_ms) [static]

Definition at line 78 of file Logging.cpp.

void Logging::periodicLog ( unsigned long  interval_ms) [static]

Definition at line 32 of file Logging.cpp.

bool Logging::removeRouteRequestReceiver ( RouteResponse res) [static, private]

Definition at line 610 of file Logging.cpp.

static void Logging::safeLogs ( ) [static]

Member Data Documentation

std::list< std::string > Logging::entries_link_frames [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_mc_frames [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_mem_consumption [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_r_table [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_rreq_initi [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_rreq_interm [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_rreq_recv [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_service_calls [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_transport_frames [static]

Definition at line 57 of file Logging.h.

std::list< std::string > Logging::entries_uc_frames [static]

Definition at line 57 of file Logging.h.

std::string Logging::link_frames_file = "unicast_link_transmission.csv" [static]

Definition at line 58 of file Logging.h.

std::string Logging::log_path = "" [static]

Definition at line 58 of file Logging.h.

std::string Logging::mc_frames_file = "multicast.csv" [static]

Definition at line 58 of file Logging.h.

std::string Logging::mem_consumption_file = "packet_memory_consumption.csv" [static]

Definition at line 58 of file Logging.h.

boost::mutex Logging::mtx_logging [static]

Definition at line 51 of file Logging.h.

ros::NodeHandle * Logging::n = NULL [static]

Definition at line 49 of file Logging.h.

std::string * Logging::robot_name = NULL [static]

Definition at line 59 of file Logging.h.

std::string Logging::route_req_dst_file = "rreq_receiver.csv" [static]

Definition at line 58 of file Logging.h.

std::string Logging::route_req_iterm_file = "rreq_intermediate.csv" [static]

Definition at line 58 of file Logging.h.

std::string Logging::route_req_src_file = "rreq_initiater.csv" [static]

Definition at line 58 of file Logging.h.

std::string Logging::routing_table_file = "routing_table.csv" [static]

Definition at line 58 of file Logging.h.

std::string Logging::sercice_calls_file = "services.csv" [static]

Definition at line 58 of file Logging.h.

std::string Logging::transport_frames_file = "transport_frames.csv" [static]

Definition at line 58 of file Logging.h.

std::string Logging::uc_frames_file = "unicast_datalink_transmission_summary.csv" [static]

Definition at line 58 of file Logging.h.

std::map< std::string, uint32_t > Logging::uint32_properties [static]

Definition at line 53 of file Logging.h.


The documentation for this class was generated from the following files:


adhoc_communication
Author(s): Guenter Cwioro , Torsten Andre
autogenerated on Thu Jun 6 2019 20:59:43