Public Member Functions | Private Attributes
segbot_simulation_apps::DoorHandler Class Reference

#include <door_handler.h>

List of all members.

Public Member Functions

bool checkClosePoses (const geometry_msgs::Pose &p1, const geometry_msgs::Pose &p2, float threshold=0.05, bool check_yaw=true)
void closeAllDoors ()
void closeAllDoorsFarAwayFromPoint (const geometry_msgs::Pose &point, float distance=2.0)
bool closeDoor (const std::string &door)
bool closeDoor (int index)
 DoorHandler ()
geometry_msgs::Pose getDefaultLocation (bool is_door, int index)
geometry_msgs::Pose getDoorLocation (int index)
float getDoorWidth (int index)
bool isDoorOpen (const std::string &door)
bool isDoorOpen (int index)
void openAllDoors ()
bool openDoor (const std::string &door)
bool openDoor (int index)
void spawnObject (bool is_door, int index=0)
bool teleportEntity (const std::string &entity, const geometry_msgs::Pose &pose)

Private Attributes

std::vector< bool > door_open_status_
std::string door_urdf_
std::vector
< bwi_planning_common::Door > 
doors_
ros::ServiceClient get_gazebo_model_client_
std::vector< int32_t > location_map_
std::vector< std::string > locations_
unsigned int num_obstacles_
std::string obstacle_urdf_
std::set< int > obstacles_in_use
ros::ServiceClient set_gazebo_model_client_
ros::ServiceClient spawn_model_client_
std::set< int > unused_obstacles_

Detailed Description

Definition at line 12 of file door_handler.h.


Constructor & Destructor Documentation

Definition at line 14 of file libsegbot_simulation_apps/door_handler.cpp.


Member Function Documentation

bool segbot_simulation_apps::DoorHandler::checkClosePoses ( const geometry_msgs::Pose p1,
const geometry_msgs::Pose p2,
float  threshold = 0.05,
bool  check_yaw = true 
)

Definition at line 204 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 169 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 192 of file libsegbot_simulation_apps/door_handler.cpp.

bool segbot_simulation_apps::DoorHandler::closeDoor ( const std::string &  door)

Definition at line 145 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 153 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 77 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 97 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 93 of file libsegbot_simulation_apps/door_handler.cpp.

bool segbot_simulation_apps::DoorHandler::isDoorOpen ( const std::string &  door)

Definition at line 177 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 185 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 139 of file libsegbot_simulation_apps/door_handler.cpp.

bool segbot_simulation_apps::DoorHandler::openDoor ( const std::string &  door)

Definition at line 116 of file libsegbot_simulation_apps/door_handler.cpp.

Definition at line 124 of file libsegbot_simulation_apps/door_handler.cpp.

void segbot_simulation_apps::DoorHandler::spawnObject ( bool  is_door,
int  index = 0 
)

Definition at line 252 of file libsegbot_simulation_apps/door_handler.cpp.

bool segbot_simulation_apps::DoorHandler::teleportEntity ( const std::string &  entity,
const geometry_msgs::Pose pose 
)

Definition at line 221 of file libsegbot_simulation_apps/door_handler.cpp.


Member Data Documentation

Definition at line 47 of file door_handler.h.

Definition at line 57 of file door_handler.h.

std::vector<bwi_planning_common::Door> segbot_simulation_apps::DoorHandler::doors_ [private]

Definition at line 43 of file door_handler.h.

Definition at line 52 of file door_handler.h.

Definition at line 45 of file door_handler.h.

std::vector<std::string> segbot_simulation_apps::DoorHandler::locations_ [private]

Definition at line 44 of file door_handler.h.

Definition at line 50 of file door_handler.h.

Definition at line 56 of file door_handler.h.

Definition at line 48 of file door_handler.h.

Definition at line 53 of file door_handler.h.

Definition at line 54 of file door_handler.h.

Definition at line 49 of file door_handler.h.


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


segbot_simulation_apps
Author(s): Piyush Khandelwal
autogenerated on Mon Oct 6 2014 07:31:00