|
enum | : FSM::State { UNKNOWN = 1,
NO_CARGO = 2,
CARGO = 4
} |
|
enum | : FSM::Event { PICKED = (1<<0),
DROPPED = (1<<1)
} |
|
|
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:
- astrobee/simulation/isaac_gazebo/src/gazebo_model_plugin_cargo/gazebo_model_plugin_cargo.cc