ISAAC  0.2.11
Flight software for the ISAAC project, adding functionality to the Astrobee robot, operating inside the International Space Station.
All Classes Functions Variables Pages
inspection::InspectionNode Class Reference
Inheritance diagram for inspection::InspectionNode:
Collaboration diagram for inspection::InspectionNode:

Public Types

enum  : FSM::Event {
  READY = (1<<0), GOAL_INSPECT = (1<<1), GOAL_CANCEL = (1<<2), GOAL_PREEMPT = (1<<3),
  GOAL_PAUSE = (1<<4), GOAL_UNPAUSE = (1<<5), MOTION_SUCCESS = (1<<6), MOTION_FAILED = (1<<7),
  MOTION_UPDATE = (1<<8), DOCK_SUCCESS = (1<<9), DOCK_FAILED = (1<<10), DOCK_UPDATE = (1<<11),
  NEXT_INSPECT = (1<<12), INSPECT_FAILED = (1<<13), INSPECT_UPDATE = (1<<14), MANUAL_STATE_SET = (1<<15)
}
 

Protected Member Functions

void Initialize (ros::NodeHandle *nh)
 
void ConnectedCallback ()
 
void GroundConnectedCallback ()
 
bool SetStateCallback (ff_msgs::SetState::Request &req, ff_msgs::SetState::Response &res)
 
bool MoveInspect (std::string const &mode, geometry_msgs::PoseArray poses)
 
void MFeedbackCallback (ff_msgs::MotionFeedbackConstPtr const &feedback)
 
void MResultCallback (ff_util::FreeFlyerActionState::Enum result_code, ff_msgs::MotionResultConstPtr const &result)
 
bool Dock (std::string const &mode)
 
void DFeedbackCallback (ff_msgs::DockFeedbackConstPtr const &feedback)
 
void DResultCallback (ff_util::FreeFlyerActionState::Enum result_code, ff_msgs::DockResultConstPtr const &result)
 
void Flashlight (double level)
 
void SendSciCamCommand (std::string command)
 
void SendPicture (double focus_distance)
 
bool ImageInspect ()
 
void SciCamInfoCallback (const sensor_msgs::CameraInfo::ConstPtr &msg)
 
void SciCamTimeout (const ros::TimerEvent &event)
 
void IFeedbackCallback (isaac_msgs::ImageInspectionFeedbackConstPtr const &feedback)
 
void IResultCallback (ff_util::FreeFlyerActionState::Enum result_code, isaac_msgs::ImageInspectionResultConstPtr const &result)
 
void GoalCallback (isaac_msgs::InspectionGoalConstPtr const &goal)
 
void Result (int32_t response, std::string const &msg="")
 
bool ReconfigureCallback (dynamic_reconfigure::Config &config)
 
void UpdateCallback (FSM::State const &state, FSM::Event const &event)
 
void PreemptCallback ()
 
void CancelCallback ()
 

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