IRI ROS Specific Algorithm Class. More...
#include <people_follower_alg_node.h>
IRI ROS Specific Algorithm Class.
Definition at line 50 of file people_follower_alg_node.h.
enum PeopleFollowerAlgNode::states [private] |
Definition at line 90 of file people_follower_alg_node.h.
Constructor.
This constructor initializes specific class attributes and all ROS communications variables to enable message exchange.
Definition at line 6 of file people_follower_alg_node.cpp.
Destructor.
This destructor frees all necessary dynamic memory allocated within this this class.
Definition at line 56 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::addNodeDiagnostics | ( | void | ) | [protected, virtual] |
node add diagnostics
In this abstract function additional ROS diagnostics applied to the specific algorithms may be added.
Implements algorithm_base::IriBaseAlgorithm< PeopleFollowerAlgorithm >.
Definition at line 396 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::followTargetGetFeedbackCallback | ( | iri_nav_msgs::followTargetFeedbackPtr & | feedback | ) | [private] |
Definition at line 317 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::followTargetGetResultCallback | ( | iri_nav_msgs::followTargetResultPtr & | result | ) | [private] |
Definition at line 309 of file people_follower_alg_node.cpp.
bool PeopleFollowerAlgNode::followTargetHasSucceedCallback | ( | void | ) | [private] |
Definition at line 295 of file people_follower_alg_node.cpp.
bool PeopleFollowerAlgNode::followTargetIsFinishedCallback | ( | void | ) | [private] |
Definition at line 284 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::followTargetStartCallback | ( | const iri_nav_msgs::followTargetGoalConstPtr & | goal | ) | [private] |
Definition at line 265 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::followTargetStopCallback | ( | void | ) | [private] |
Definition at line 277 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::mainNodeThread | ( | void | ) | [protected, virtual] |
main node thread
This is the main thread node function. Code written here will be executed in every node loop while the algorithm is on running state. Loop frequency can be tuned by modifying loop_rate attribute.
Here data related to the process loop or to ROS topics (mainly data structs related to the MSG and SRV files) must be updated. ROS publisher objects must publish their data in this process. ROS client servers may also request data to the corresponding server topics.
Implements algorithm_base::IriBaseAlgorithm< PeopleFollowerAlgorithm >.
Definition at line 67 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::moveBaseActive | ( | ) | [private] |
Definition at line 344 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::moveBaseDone | ( | const actionlib::SimpleClientGoalState & | state, |
const move_base_msgs::MoveBaseResultConstPtr & | result | ||
) | [private] |
Definition at line 325 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::moveBaseFeedback | ( | const move_base_msgs::MoveBaseFeedbackConstPtr & | feedback | ) | [private] |
Definition at line 349 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::moveBaseMakeActionRequest | ( | const move_base_msgs::MoveBaseGoal & | goal | ) | [private] |
Definition at line 367 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::node_config_update | ( | Config & | config, |
uint32_t | level | ||
) | [protected, virtual] |
dynamic reconfigure server callback
This method is called whenever a new configuration is received through the dynamic reconfigure. The derivated generic algorithm class must implement it.
config | an object with new configuration from all algorithm parameters defined in the config file. |
level | integer referring the level in which the configuration has been changed. |
Implements algorithm_base::IriBaseAlgorithm< PeopleFollowerAlgorithm >.
Definition at line 388 of file people_follower_alg_node.cpp.
void PeopleFollowerAlgNode::target_pose_callback | ( | const geometry_msgs::PoseStamped::ConstPtr & | msg | ) | [private] |
Definition at line 232 of file people_follower_alg_node.cpp.
geometry_msgs::PoseStamped PeopleFollowerAlgNode::current_global_target_pose_ [private] |
Definition at line 103 of file people_follower_alg_node.h.
states PeopleFollowerAlgNode::current_state_ [private] |
Definition at line 91 of file people_follower_alg_node.h.
float PeopleFollowerAlgNode::dist_to_goal_ [private] |
Definition at line 94 of file people_follower_alg_node.h.
CEventServer* PeopleFollowerAlgNode::event_server_ [private] |
Definition at line 81 of file people_follower_alg_node.h.
std::string PeopleFollowerAlgNode::fixed_frame_ [private] |
Definition at line 100 of file people_follower_alg_node.h.
std::string PeopleFollowerAlgNode::follow_target_done_event_id_ [private] |
Definition at line 88 of file people_follower_alg_node.h.
IriActionServer<iri_nav_msgs::followTargetAction> PeopleFollowerAlgNode::followTarget_aserver_ [private] |
Definition at line 65 of file people_follower_alg_node.h.
geometry_msgs::PoseStamped PeopleFollowerAlgNode::global_target_goal_ [private] |
Definition at line 102 of file people_follower_alg_node.h.
const unsigned int PeopleFollowerAlgNode::MAX_ITERS_NO_MSG = 200 [static, private] |
Definition at line 96 of file people_follower_alg_node.h.
actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> PeopleFollowerAlgNode::moveBase_client_ [private] |
Definition at line 74 of file people_follower_alg_node.h.
std::string PeopleFollowerAlgNode::moveBase_done_event_id_ [private] |
Definition at line 85 of file people_follower_alg_node.h.
std::string PeopleFollowerAlgNode::moveBase_preempt_event_id_ [private] |
Definition at line 86 of file people_follower_alg_node.h.
std::string PeopleFollowerAlgNode::new_req_event_id_ [private] |
Definition at line 84 of file people_follower_alg_node.h.
unsigned int PeopleFollowerAlgNode::no_target_pose_msg_received_ [private] |
Definition at line 95 of file people_follower_alg_node.h.
unsigned int PeopleFollowerAlgNode::request_id_ [private] |
Definition at line 93 of file people_follower_alg_node.h.
std::string PeopleFollowerAlgNode::target_frame_ [private] |
Definition at line 99 of file people_follower_alg_node.h.
CMutex PeopleFollowerAlgNode::target_pose_mutex_ [private] |
Definition at line 58 of file people_follower_alg_node.h.
std::string PeopleFollowerAlgNode::target_pose_received_event_id_ [private] |
Definition at line 87 of file people_follower_alg_node.h.
Definition at line 56 of file people_follower_alg_node.h.
std::string PeopleFollowerAlgNode::tf_prefix_ [private] |
Definition at line 98 of file people_follower_alg_node.h.