Protected Member Functions | |
void | cbCostmap (const costmap_cspace_msgs::CSpace3D::ConstPtr &msg) |
void | cbMap (const nav_msgs::OccupancyGrid::ConstPtr &msg) |
void | cbMapLocal (const nav_msgs::OccupancyGrid::ConstPtr &msg) |
void | cbPath (const nav_msgs::Path::ConstPtr &msg) |
void | cbPathVel (const trajectory_tracker_msgs::PathWithVelocity::ConstPtr &msg) |
void | cbStatus (const planner_cspace_msgs::PlannerStatus::ConstPtr &msg) |
void | dumpRobotTrajectory () |
tf2::Stamped< tf2::Transform > | lookupRobotTrans (const ros::Time &now) |
Navigate () | |
void | pubMapLocal () |
virtual void | SetUp () |
void | waitForPlannerStatus (const std::string &name, const int expected_error) |
Protected Attributes | |
costmap_cspace_msgs::CSpace3D::ConstPtr | costmap_ |
size_t | local_map_apply_cnt_ |
nav_msgs::OccupancyGrid::ConstPtr | map_ |
nav_msgs::OccupancyGrid::Ptr | map_local_ |
ros::NodeHandle | nh_ |
nav_msgs::Path::ConstPtr | path_ |
trajectory_tracker_msgs::PathWithVelocity::ConstPtr | path_vel_ |
planner_cspace_msgs::PlannerStatus::ConstPtr | planner_status_ |
ros::NodeHandle | pnh_ |
ros::Publisher | pub_initial_pose_ |
ros::Publisher | pub_map_ |
ros::Publisher | pub_map_local_ |
ros::Publisher | pub_patrol_nodes_ |
ros::ServiceClient | srv_forget_ |
ros::Subscriber | sub_costmap_ |
ros::Subscriber | sub_map_ |
ros::Subscriber | sub_map_local_ |
ros::Subscriber | sub_path_ |
ros::Subscriber | sub_path_vel_ |
ros::Subscriber | sub_status_ |
std::string | test_scope_ |
tf2_ros::Buffer | tfbuf_ |
tf2_ros::TransformListener | tfl_ |
std::vector< tf2::Stamped< tf2::Transform > > | traj_ |
Definition at line 55 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 83 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 189 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 194 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 199 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 216 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 234 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 208 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 281 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 272 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 252 of file test_navigate.cpp.
|
inlineprotectedvirtual |
Definition at line 105 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 304 of file test_navigate.cpp.
|
protected |
Definition at line 65 of file test_navigate.cpp.
|
protected |
Definition at line 79 of file test_navigate.cpp.
|
protected |
Definition at line 62 of file test_navigate.cpp.
|
protected |
Definition at line 63 of file test_navigate.cpp.
|
protected |
Definition at line 59 of file test_navigate.cpp.
|
protected |
Definition at line 66 of file test_navigate.cpp.
|
protected |
Definition at line 67 of file test_navigate.cpp.
|
protected |
Definition at line 64 of file test_navigate.cpp.
|
protected |
Definition at line 58 of file test_navigate.cpp.
|
protected |
Definition at line 77 of file test_navigate.cpp.
|
protected |
Definition at line 75 of file test_navigate.cpp.
|
protected |
Definition at line 76 of file test_navigate.cpp.
|
protected |
Definition at line 78 of file test_navigate.cpp.
|
protected |
Definition at line 74 of file test_navigate.cpp.
|
protected |
Definition at line 70 of file test_navigate.cpp.
|
protected |
Definition at line 68 of file test_navigate.cpp.
|
protected |
Definition at line 69 of file test_navigate.cpp.
|
protected |
Definition at line 72 of file test_navigate.cpp.
|
protected |
Definition at line 73 of file test_navigate.cpp.
|
protected |
Definition at line 71 of file test_navigate.cpp.
|
protected |
Definition at line 81 of file test_navigate.cpp.
|
protected |
Definition at line 60 of file test_navigate.cpp.
|
protected |
Definition at line 61 of file test_navigate.cpp.
|
protected |
Definition at line 80 of file test_navigate.cpp.