Project: engagement_recognition

License: BSD

Dependencies:

Used by: None

All Packages

EngagementParams Class Reference

#include <engagement_params.h>

List of all members.

Static Public Member Functions

static void createNodeHandles ()
static void destroy ()
static void destroyNodeHandles ()
static const char * getActorTag (std::string actor)
static const char * getAPTag ()
static ros::NodeHandle * getBaseHandle ()
static const char * getBCTag ()
static ros::NodeHandle * getCollabHandle ()
static ros::NodeHandle * getConfAdjacencyPairHandle ()
static ros::NodeHandle * getConfBackchannelHandle ()
static ros::NodeHandle * getConfDirGazeHandle ()
static ros::NodeHandle * getConfHandle ()
static ros::NodeHandle * getConfMFGazeHandle ()
static const char * getDGTag (std::string object)
static ros::NodeHandle * getInternalHandle ()
static std::string getLogDirectory ()
static std::string getLogFile ()
static const char * getMFGTag ()
static const char * getObjectTag (std::string object)
static ros::NodeHandle * getPerformingHandle ()
static ros::NodeHandle * getRecogHandle ()
static ros::NodeHandle * getRecogHumanHandle ()
static ros::NodeHandle * getRecogRobotHandle ()
static const char * getRecogTag ()
static const char * getSemaphoreTag ()
static unsigned long getStartTime ()
static const char * getStateTag (std::string name)
static int getVerbosity ()
static ros::NodeHandle * getVisionHandle ()
static bool isDegraded ()
static void retrieveParameters (bool force=false)
static void setStartTime (unsigned long val)

Private Member Functions

 EngagementParams ()

Static Private Member Functions

static EngagementParamsgetParams ()

Private Attributes

int actor_bg_color_
int actor_fg_color_
int ap_bg_color_
int ap_fg_color_
ros::NodeHandle * base_handle_
int bc_bg_color_
int bc_fg_color_
ros::NodeHandle * collab_handle_
ros::NodeHandle * conf_adjacency_pair_handle_
ros::NodeHandle * conf_backchannel_handle_
ros::NodeHandle * conf_dir_gaze_handle_
ros::NodeHandle * conf_handle_
ros::NodeHandle * conf_mf_gaze_handle_
bool degraded_
int dg_bg_color_
int dg_fg_color_
ros::NodeHandle * internal_handle_
std::string log_directory_
std::string log_file_
int mfg_bg_color_
int mfg_fg_color_
ros::NodeHandle * performing_handle_
int recog_bg_color_
int recog_fg_color_
ros::NodeHandle * recog_handle_
ros::NodeHandle * recog_human_handle_
ros::NodeHandle * recog_robot_handle_
bool retrieved_parameters_
int sema_bg_color_
int sema_fg_color_
unsigned long start_time_
int state_bg_color_
int state_fg_color_
int verbosity_
ros::NodeHandle * vision_handle_

Static Private Attributes

static EngagementParamsparam_ = new EngagementParams()

Detailed Description

This class implements the singleton design pattern in order to provide several parameters that will be used throughout the entire system, such as verbosity. It provides methods for retrieving each of these parameters.

Author:
Brett Ponsler (bponsler (at) wpi (dot) edu)

Definition at line 49 of file engagement_params.h.


Constructor & Destructor Documentation

EngagementParams::EngagementParams (  )  [private]

Default constructor for the EngagementParams class.

Definition at line 59 of file engagement_params.cpp.


Member Function Documentation

void EngagementParams::createNodeHandles (  )  [static]

Create all the NodeHandles.

Definition at line 260 of file engagement_params.cpp.

void EngagementParams::destroy (  )  [static]

Destroy the static EngagementParams object.

Definition at line 42 of file engagement_params.cpp.

void EngagementParams::destroyNodeHandles (  )  [static]

Destroy all the NodeHandles.

Definition at line 315 of file engagement_params.cpp.

const char * EngagementParams::getActorTag ( std::string  actor  )  [static]

Append the actor color around the actor type.

Parameters:
name The name of the Actor
Returns:
The tag

Definition at line 728 of file engagement_params.cpp.

const char * EngagementParams::getAPTag (  )  [static]

Append the adjacency pair color around the recognizer type.

Returns:
The tag

Definition at line 622 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getBaseHandle (  )  [static]

Return the base level NodeHandle.

Returns:
The base level NodeHandle

Definition at line 442 of file engagement_params.cpp.

const char * EngagementParams::getBCTag (  )  [static]

Append the backchannel color around the recognizer type.

Returns:
The tag

Definition at line 646 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getCollabHandle (  )  [static]

Return the collab NodeHandle.

Returns:
The collab NodeHandle

Definition at line 490 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getConfAdjacencyPairHandle (  )  [static]

Return the configuration adjacency pair NodeHandle.

Returns:
The configuration adjacency pair NodeHandle

Definition at line 574 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getConfBackchannelHandle (  )  [static]

Return the configuration backchannel NodeHandle.

Returns:
The configuration backchannel NodeHandle

Definition at line 586 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getConfDirGazeHandle (  )  [static]

Return the configuration directed gaze NodeHandle.

Returns:
The configuration directed gaze NodeHandle

Definition at line 550 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getConfHandle (  )  [static]

Return the conf NodeHandle.

Returns:
The conf NodeHandle

Definition at line 466 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getConfMFGazeHandle (  )  [static]

Return the configuration mutual facial gaze NodeHandle.

Returns:
The configuration mutual facial gaze NodeHandle

Definition at line 562 of file engagement_params.cpp.

const char * EngagementParams::getDGTag ( std::string  object  )  [static]

Append the directed gaze color around the recognizer type.

Parameters:
object The object
Returns:
The tag

Definition at line 670 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getInternalHandle (  )  [static]

Return the internal NodeHandle.

Returns:
The internal NodeHandle

Definition at line 454 of file engagement_params.cpp.

std::string EngagementParams::getLogDirectory (  )  [static]

Get the log directory.

Returns:
The log directory

Definition at line 217 of file engagement_params.cpp.

std::string EngagementParams::getLogFile (  )  [static]

Get the log file.

Returns:
The log file

Definition at line 198 of file engagement_params.cpp.

const char * EngagementParams::getMFGTag (  )  [static]

Append the mutual facial gaze color around the recognizer type.

Returns:
The tag

Definition at line 703 of file engagement_params.cpp.

const char * EngagementParams::getObjectTag ( std::string  object  )  [static]

Get the color code depending on the name of the object.

Parameters:
object The object
Returns:
The tag

Definition at line 803 of file engagement_params.cpp.

EngagementParams * EngagementParams::getParams (  )  [static, private]

Method to return the instance of the EngagementParams class.

Returns:
The instance of the EngagementParams class

Definition at line 79 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getPerformingHandle (  )  [static]

Return the performing NodeHandle.

Returns:
The performing NodeHandle

Definition at line 502 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getRecogHandle (  )  [static]

Return the recognition NodeHandle.

Returns:
The recognition NodeHandle

Definition at line 514 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getRecogHumanHandle (  )  [static]

Return the recognition human NodeHandle.

Returns:
The recognition human NodeHandle

Definition at line 526 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getRecogRobotHandle (  )  [static]

Return the recognition robotNodeHandle.

Returns:
The recognition robot NodeHandle

Definition at line 538 of file engagement_params.cpp.

const char * EngagementParams::getRecogTag (  )  [static]

Return the tag that will be appended before print statements for the recognition node.

Returns:
The tag

Definition at line 598 of file engagement_params.cpp.

const char * EngagementParams::getSemaphoreTag (  )  [static]

Append the semaphore color around the semaphore type.

Returns:
The tag

Definition at line 753 of file engagement_params.cpp.

unsigned long EngagementParams::getStartTime (  )  [static]

Get the start time.

Returns:
The start time

Definition at line 248 of file engagement_params.cpp.

const char * EngagementParams::getStateTag ( std::string  name  )  [static]

Append the actor color around the state type.

Parameters:
name The name of the state
Returns:
The tag

Definition at line 778 of file engagement_params.cpp.

int EngagementParams::getVerbosity (  )  [static]

Return the verbosity.

Returns:
The verbosity level

Definition at line 180 of file engagement_params.cpp.

ros::NodeHandle * EngagementParams::getVisionHandle (  )  [static]

Return the vision NodeHandle.

Returns:
The vision NodeHandle

Definition at line 478 of file engagement_params.cpp.

bool EngagementParams::isDegraded (  )  [static]

Determine if the recognition node is degraded or not.

Returns:
True if degraded, false otherwise

Definition at line 162 of file engagement_params.cpp.

void EngagementParams::retrieveParameters ( bool  force = false  )  [static]

Retrieve all the parameters needed, only if they have not yet been retrieved (unless we're forcing the retrieval).

Parameters:
force Force the retrieval of parameters

Definition at line 89 of file engagement_params.cpp.

void EngagementParams::setStartTime ( unsigned long  val  )  [static]

Set the start time.

Parameters:
val The new start time

Definition at line 235 of file engagement_params.cpp.


Member Data Documentation

The background color used for the actor.

Definition at line 88 of file engagement_params.h.

The foreground color used for the actor.

Definition at line 90 of file engagement_params.h.

The background color used for the adjacency pair recognizer.

Definition at line 72 of file engagement_params.h.

The foreground color used for the adjacency pair recognizer.

Definition at line 74 of file engagement_params.h.

ros::NodeHandle* EngagementParams::base_handle_ [private]

The base level NodeHandle.

Definition at line 119 of file engagement_params.h.

The background color used for the backchannel recognizer.

Definition at line 76 of file engagement_params.h.

The foreground color used for the backchannel recognizer.

Definition at line 78 of file engagement_params.h.

ros::NodeHandle* EngagementParams::collab_handle_ [private]

The collaboration NodeHandle.

Definition at line 123 of file engagement_params.h.

The configuration adjacency pair NodeHandle.

Definition at line 143 of file engagement_params.h.

ros::NodeHandle* EngagementParams::conf_backchannel_handle_ [private]

The configuration backchannel NodeHandle.

Definition at line 145 of file engagement_params.h.

ros::NodeHandle* EngagementParams::conf_dir_gaze_handle_ [private]

The configuration directed gaze NodeHandle.

Definition at line 139 of file engagement_params.h.

ros::NodeHandle* EngagementParams::conf_handle_ [private]

The configuration NodeHandle.

Definition at line 137 of file engagement_params.h.

ros::NodeHandle* EngagementParams::conf_mf_gaze_handle_ [private]

The configuration mutual facial gaze NodeHandle.

Definition at line 141 of file engagement_params.h.

Determine if the recognition node is degraded or not.

Definition at line 59 of file engagement_params.h.

The background color used for the directed gaze recognizer.

Definition at line 80 of file engagement_params.h.

The foreground color used for the directed gaze recognizer.

Definition at line 82 of file engagement_params.h.

ros::NodeHandle* EngagementParams::internal_handle_ [private]

The configuration NodeHandle.

Definition at line 134 of file engagement_params.h.

std::string EngagementParams::log_directory_ [private]

The log directory parameter.

Definition at line 104 of file engagement_params.h.

std::string EngagementParams::log_file_ [private]

The log file parameter.

Definition at line 101 of file engagement_params.h.

The background color used for the mutual facial gaze recognizer.

Definition at line 84 of file engagement_params.h.

The foreground color used for the mutual facial gaze recognizer.

Definition at line 86 of file engagement_params.h.

The instance of the EngagementParams object.

Definition at line 53 of file engagement_params.h.

ros::NodeHandle* EngagementParams::performing_handle_ [private]

The performing NodeHandle.

Definition at line 125 of file engagement_params.h.

The background color code used for the recognition node.

Definition at line 68 of file engagement_params.h.

The foreground color code used for the recognition node.

Definition at line 70 of file engagement_params.h.

ros::NodeHandle* EngagementParams::recog_handle_ [private]

The recognition NodeHandle.

Definition at line 127 of file engagement_params.h.

ros::NodeHandle* EngagementParams::recog_human_handle_ [private]

The recognition human NodeHandle.

Definition at line 129 of file engagement_params.h.

ros::NodeHandle* EngagementParams::recog_robot_handle_ [private]

The recognition robot NodeHandle.

Definition at line 131 of file engagement_params.h.

Determine if the parameters have been retrieved.

Definition at line 56 of file engagement_params.h.

The background color used for the semaphore.

Definition at line 96 of file engagement_params.h.

The foreground color used for the semaphore.

Definition at line 98 of file engagement_params.h.

unsigned long EngagementParams::start_time_ [private]

The start time.

Definition at line 65 of file engagement_params.h.

The background color used for the state.

Definition at line 92 of file engagement_params.h.

The foreground color used for the state.

Definition at line 94 of file engagement_params.h.

The verbosity parameter.

Definition at line 62 of file engagement_params.h.

ros::NodeHandle* EngagementParams::vision_handle_ [private]

The vision NodeHandle.

Definition at line 121 of file engagement_params.h.


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

engagement_recognition
Author(s): Brett Ponsler (bponsler (at) wpi (dot) edu)
autogenerated on Fri Sep 9 10:35:49 2011