NASA Astrobee Robot Software  0.19.1
Flight software for the Astrobee robots operating inside the International Space Station.
states::StatesNodelet Class Reference
Inheritance diagram for states::StatesNodelet:
Inheritance graph

Public Member Functions

 StatesNodelet ()
 
virtual ~StatesNodelet ()
 
- Public Member Functions inherited from ff_util::FreeFlyerNodelet
 FreeFlyerNodelet (bool autostart_hb_timer=true)
 
 FreeFlyerNodelet (std::string const &name, bool autostart_hb_timer=true)
 
virtual ~FreeFlyerNodelet ()
 
void AssertFault (FaultKeys enum_key, std::string const &message, ros::Time time_fault_occurred=ros::Time::now())
 
void ClearAllFaults ()
 
void ClearFault (FaultKeys enum_key)
 
void PrintFaults ()
 
ros::NodeHandle * GetPlatformHandle (bool multithreaded=false)
 
ros::NodeHandle * GetPrivateHandle (bool multithreaded=false)
 
std::string GetName ()
 
std::string GetPlatform ()
 
std::string GetTransform (std::string const &child)
 

Protected Member Functions

virtual void Initialize (ros::NodeHandle *nh)
 
void Startup ()
 
void Shutdown ()
 
void BatteryStateCallback (const sensor_msgs::BatteryState::ConstPtr &msg)
 
void LiveStreamingCallback (const ff_msgs::CameraStatesStamped::ConstPtr &msg)
 
void MobilityMotionStateCallback (const ff_msgs::MotionState::ConstPtr &msg)
 
void DockStateCallback (const ff_msgs::DockState::ConstPtr &msg)
 
void MotionActionResultCallback (const ff_msgs::MotionActionResult::ConstPtr &msg)
 
void ChangeCurrentState (uint8_t new_state)
 
- Protected Member Functions inherited from ff_util::FreeFlyerNodelet
virtual void Reset ()
 
virtual void Sleep ()
 
virtual void Wakeup ()
 
void StopHeartbeat ()
 
void SendDiagnostics (const std::vector< diagnostic_msgs::KeyValue > &keyval)
 
void Setup (ros::NodeHandle &nh, ros::NodeHandle &nh_mt, std::string plugin_name)
 

Additional Inherited Members

- Public Types inherited from ff_util::FreeFlyerNodelet
enum  ResolveType : uint8_t { NAMESPACE = 0, TRANSFORM = 1, RESOURCE = 1 }
 
- Protected Attributes inherited from ff_util::FreeFlyerNodelet
std::map< std::string, int > faults_
 

Constructor & Destructor Documentation

◆ StatesNodelet()

states::StatesNodelet::StatesNodelet ( )
inline

◆ ~StatesNodelet()

virtual states::StatesNodelet::~StatesNodelet ( )
inlinevirtual

Member Function Documentation

◆ BatteryStateCallback()

void states::StatesNodelet::BatteryStateCallback ( const sensor_msgs::BatteryState::ConstPtr &  msg)
inlineprotected

◆ ChangeCurrentState()

void states::StatesNodelet::ChangeCurrentState ( uint8_t  new_state)
inlineprotected

◆ DockStateCallback()

void states::StatesNodelet::DockStateCallback ( const ff_msgs::DockState::ConstPtr &  msg)
inlineprotected

◆ Initialize()

virtual void states::StatesNodelet::Initialize ( ros::NodeHandle *  nh)
inlineprotectedvirtual

Reimplemented from ff_util::FreeFlyerNodelet.

◆ LiveStreamingCallback()

void states::StatesNodelet::LiveStreamingCallback ( const ff_msgs::CameraStatesStamped::ConstPtr &  msg)
inlineprotected

◆ MobilityMotionStateCallback()

void states::StatesNodelet::MobilityMotionStateCallback ( const ff_msgs::MotionState::ConstPtr &  msg)
inlineprotected

◆ MotionActionResultCallback()

void states::StatesNodelet::MotionActionResultCallback ( const ff_msgs::MotionActionResult::ConstPtr &  msg)
inlineprotected

◆ Shutdown()

void states::StatesNodelet::Shutdown ( )
inlineprotected

◆ Startup()

void states::StatesNodelet::Startup ( )
inlineprotected

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