Public Types | Public Member Functions | Private Member Functions | Private Attributes
mdm_library::StateLayer Class Reference

#include <state_layer.h>

List of all members.

Public Types

typedef boost::shared_ptr
< std::set< uint32_t > > 
SFIDSetPtr

Public Member Functions

void addStateFactor (const StateDep::SFDeps &deps)
void addStateFactor (const StateDep &deps)
void predicateMapCallback (const predicate_manager::PredicateInfoMapConstPtr &msg)
void predicateUpdatesCallback (const predicate_manager::PredicateUpdateConstPtr &msg)
 StateLayer ()

Private Member Functions

std::string factorString (unsigned k)
void publishJointState ()
void updateStateInfo (const uint32_t &factor)

Private Attributes

std::vector< uint32_t > factored_state_
std::vector< StateDep::SFDepsfactored_state_deps_
boost::unordered_map
< predicate_manager::NameID,
SFIDSetPtr
named_pred_observer_
boost::unordered_map
< predicate_manager::NameID,
boost::shared_ptr< bool > > 
named_value_map_
ros::NodeHandle nh_
boost::unordered_map
< predicate_manager::NrID,
SFIDSetPtr,
predicate_manager::cantor_pair_hash
nr_pred_observer_
boost::unordered_map
< predicate_manager::NrID,
boost::shared_ptr< bool >
, predicate_manager::cantor_pair_hash
nr_value_map_
ros::Subscriber pred_map_sub_
ros::Subscriber pred_update_sub_
ros::Subscriber state_metadata_sub_
ros::Publisher state_pub_

Detailed Description

Definition at line 42 of file state_layer.h.


Member Typedef Documentation

typedef boost::shared_ptr<std::set<uint32_t> > mdm_library::StateLayer::SFIDSetPtr

Definition at line 45 of file state_layer.h.


Constructor & Destructor Documentation

Definition at line 38 of file state_layer.cpp.


Member Function Documentation

factor index is factored_state_.size()

Definition at line 165 of file state_layer.cpp.

void StateLayer::addStateFactor ( const StateDep deps)

Definition at line 186 of file state_layer.cpp.

std::string StateLayer::factorString ( unsigned  k) [private]

binary state factor

mutually-exclusive-valued state factor

Definition at line 105 of file state_layer.cpp.

void StateLayer::predicateMapCallback ( const predicate_manager::PredicateInfoMapConstPtr &  msg)

name_id has been registered as the dependency of some SF

now we can access the value by the NrID instead

Definition at line 144 of file state_layer.cpp.

void StateLayer::predicateUpdatesCallback ( const predicate_manager::PredicateUpdateConstPtr &  msg)

Definition at line 48 of file state_layer.cpp.

void StateLayer::publishJointState ( ) [private]

Definition at line 195 of file state_layer.cpp.

void StateLayer::updateStateInfo ( const uint32_t &  factor) [private]

Definition at line 223 of file state_layer.cpp.


Member Data Documentation

std::vector<uint32_t> mdm_library::StateLayer::factored_state_ [private]

Definition at line 79 of file state_layer.h.

Definition at line 77 of file state_layer.h.

Definition at line 75 of file state_layer.h.

boost::unordered_map<predicate_manager::NameID, boost::shared_ptr<bool> > mdm_library::StateLayer::named_value_map_ [private]

Definition at line 69 of file state_layer.h.

Definition at line 60 of file state_layer.h.

Definition at line 74 of file state_layer.h.

Definition at line 68 of file state_layer.h.

Definition at line 61 of file state_layer.h.

Definition at line 62 of file state_layer.h.

Definition at line 63 of file state_layer.h.

Definition at line 64 of file state_layer.h.


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


mdm_library
Author(s): Joao Messias
autogenerated on Wed Aug 26 2015 12:28:41