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
gazebo::GazeboModelPluginCargo Class Reference
Inheritance diagram for gazebo::GazeboModelPluginCargo:
Collaboration diagram for gazebo::GazeboModelPluginCargo:

Public Types

enum  : FSM::State { UNKNOWN = 1, NO_CARGO = 2, CARGO = 4 }
 
enum  : FSM::Event { PICKED = (1<<0), DROPPED = (1<<1) }
 

Protected Member Functions

void LoadCallback (ros::NodeHandle *nh, physics::ModelPtr model, sdf::ElementPtr sdf)
 
bool DespawnCallback (ff_msgs::SetState::Request &req, ff_msgs::SetState::Response &res)
 
void StateCallback (FSM::State const &state, FSM::FSM::Event const &event)
 
void BerthCallback ()
 
void Lock ()
 
void Unlock ()
 
void CargoActionCallback (isaac_msgs::CargoState::ConstPtr const &msg)
 

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