#include <ros/ros.h>
#include <tf/transform_listener.h>
#include <std_msgs/String.h>
#include <std_msgs/Bool.h>
#include <std_srvs/Empty.h>
#include <geometry_msgs/PoseStamped.h>
#include <actionlib/client/simple_action_client.h>
#include <actionlib_msgs/GoalStatus.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <stdio.h>
#include <string>
#include <sstream>
#include <open_door_detector/detect_open_door.h>
Go to the source code of this file.
Enumerations | |
enum | state { START, START_POS, WAIT_BUTTON, WAIT_ELEVATOR, DRIVE_DOOR, DRIVE_IN, ROTATION } |
Functions | |
void | buttonCb (std_msgs::Bool msg) |
void | createOffsetPose (geometry_msgs::PoseStamped *goal, float posX_off, float posY_off, float rotW_off) |
void | createPoseFromParams (std::string param_name, geometry_msgs::PoseStamped *pose) |
int | main (int argc, char **argv) |
Variables | |
float | angle |
int | current_goal = 0 |
float | dist |
ros::Time | last_button_msg_time |
bool | last_button_state = false |
float | posX_off |
float | posY_off |
float | rotW_off |
float | width |
enum state |
Definition at line 46 of file state_machine_elevator.cpp.
void buttonCb | ( | std_msgs::Bool | msg | ) |
Definition at line 266 of file state_machine_elevator.cpp.
void createOffsetPose | ( | geometry_msgs::PoseStamped * | goal, |
float | posX_off, | ||
float | posY_off, | ||
float | rotW_off | ||
) |
Definition at line 292 of file state_machine_elevator.cpp.
void createPoseFromParams | ( | std::string | param_name, |
geometry_msgs::PoseStamped * | pose | ||
) |
Function that extracts a PoseStamped representation from the parameter group param_name of the goals namespace and stores it in the provided.
INPUT: std::string param_name: name of the PoseStamped parameter geometry_msgs::PoseStamped* pose: reference to the pose that to be changed OUTPUT: none
Definition at line 281 of file state_machine_elevator.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 50 of file state_machine_elevator.cpp.
float angle |
Definition at line 37 of file state_machine_elevator.cpp.
int current_goal = 0 |
Definition at line 25 of file state_machine_elevator.cpp.
float dist |
Definition at line 38 of file state_machine_elevator.cpp.
This demo checks which elevator door is open (left or right) and try to drive into the elevator
Definition at line 24 of file state_machine_elevator.cpp.
bool last_button_state = false |
Definition at line 30 of file state_machine_elevator.cpp.
float posX_off |
Definition at line 34 of file state_machine_elevator.cpp.
float posY_off |
Definition at line 35 of file state_machine_elevator.cpp.
float rotW_off |
Definition at line 36 of file state_machine_elevator.cpp.
float width |
Definition at line 39 of file state_machine_elevator.cpp.