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 | 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 () |
Protected Attributes | |
costmap_cspace_msgs::CSpace3D::ConstPtr | costmap_ |
size_t | local_map_apply_cnt_ |
nav_msgs::OccupancyGrid::ConstPtr | map_ |
nav_msgs::OccupancyGrid::ConstPtr | map_local_ |
ros::NodeHandle | nh_ |
nav_msgs::Path::ConstPtr | path_ |
planner_cspace_msgs::PlannerStatus::ConstPtr | planner_status_ |
ros::Publisher | pub_initial_pose_ |
ros::Publisher | pub_map_ |
ros::Publisher | pub_map_local_ |
ros::ServiceClient | srv_forget_ |
ros::Subscriber | sub_costmap_ |
ros::Subscriber | sub_map_ |
ros::Subscriber | sub_map_local_ |
ros::Subscriber | sub_path_ |
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 69 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 93 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 173 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 178 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 183 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 196 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 188 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 232 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 223 of file test_navigate.cpp.
|
inlineprotected |
Definition at line 214 of file test_navigate.cpp.
|
inlineprotectedvirtual |
Definition at line 112 of file test_navigate.cpp.
|
protected |
Definition at line 78 of file test_navigate.cpp.
|
protected |
Definition at line 89 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 72 of file test_navigate.cpp.
|
protected |
Definition at line 79 of file test_navigate.cpp.
|
protected |
Definition at line 77 of file test_navigate.cpp.
|
protected |
Definition at line 88 of file test_navigate.cpp.
|
protected |
Definition at line 86 of file test_navigate.cpp.
|
protected |
Definition at line 87 of file test_navigate.cpp.
|
protected |
Definition at line 85 of file test_navigate.cpp.
|
protected |
Definition at line 82 of file test_navigate.cpp.
|
protected |
Definition at line 80 of file test_navigate.cpp.
|
protected |
Definition at line 81 of file test_navigate.cpp.
|
protected |
Definition at line 84 of file test_navigate.cpp.
|
protected |
Definition at line 83 of file test_navigate.cpp.
|
protected |
Definition at line 91 of file test_navigate.cpp.
|
protected |
Definition at line 73 of file test_navigate.cpp.
|
protected |
Definition at line 74 of file test_navigate.cpp.
|
protected |
Definition at line 90 of file test_navigate.cpp.