publishes a command message to follow a trajectory More...
#include <ros/ros.h>
#include <trajectory_planner/c_trajectory.h>
#include <trajectory_planner/c_manage_trajectory.h>
#include <atlasmv_base/AtlasmvStatus.h>
#include <atlasmv_base/AtlasmvMotionCommand.h>
#include <pcl/ros/conversions.h>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <math.h>
#include <boost/lexical_cast.hpp>
#include <boost/format.hpp>
#include <trajectory_planner/traj_info.h>
Go to the source code of this file.
Functions | |
void | Info_handler (const trajectory_planner::traj_info &msg) |
bool | jump_node (double dist_init, int node) |
Determines if the robot is already on the following node. | |
int | main (int argc, char **argv) |
Main code of the nodelet. | |
void | send_command_message (int current_node) |
Callback of published message. | |
void | StatusMessageHandler (const atlasmv_base::AtlasmvStatus &msg) |
Define message status. | |
Variables | |
atlasmv_base::AtlasmvStatus | base_status |
atlasmv_base::AtlasmvMotionCommand | command |
ros::Publisher | commandPublisher |
double | dist_init |
trajectory_planner::traj_info | info |
ros::NodeHandle * | p_n |
publishes a command message to follow a trajectory
Definition in file trajectory_executive.cpp.
void Info_handler | ( | const trajectory_planner::traj_info & | msg | ) |
const | trajectory_planner::traj_info& msg |
Definition at line 143 of file trajectory_executive.cpp.
bool jump_node | ( | double | dist_init, | |
int | node | |||
) |
Determines if the robot is already on the following node.
double | dist_init | |
int | node | |
c_trajectoryPtr | t |
Definition at line 104 of file trajectory_executive.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Main code of the nodelet.
Generates a frame higher than the car frame, to publish the point cloud to the mtt.
Publishes the trajectories message and the command message
int | argc | |
char | **argv |
Definition at line 158 of file trajectory_executive.cpp.
void send_command_message | ( | int | current_node | ) |
Callback of published message.
Comand message send to robotic vehicle
int |
Definition at line 67 of file trajectory_executive.cpp.
void StatusMessageHandler | ( | const atlasmv_base::AtlasmvStatus & | msg | ) |
Define message status.
const | atlasmv_base::AtlasmvStatus& msg |
Definition at line 132 of file trajectory_executive.cpp.
atlasmv_base::AtlasmvStatus base_status |
Definition at line 58 of file trajectory_executive.cpp.
atlasmv_base::AtlasmvMotionCommand command |
Definition at line 55 of file trajectory_executive.cpp.
ros::Publisher commandPublisher |
Definition at line 53 of file trajectory_executive.cpp.
double dist_init |
Definition at line 57 of file trajectory_executive.cpp.
trajectory_planner::traj_info info |
Definition at line 54 of file trajectory_executive.cpp.
ros::NodeHandle* p_n |
Definition at line 56 of file trajectory_executive.cpp.