Go to the documentation of this file.
4 #define NODE_NAME "operator"
5 #define COMMAND_TOPIC "cmd"
6 #define CONTROL_TOPIC "cmd_vel"
7 #define ROUTE_TOPIC "route"
8 #define PLAN_TOPIC "desired"
9 #define LUT_RESOLUTION 100
13 #include <sensor_msgs/PointCloud.h>
14 #include <nav2d_operator/cmd.h>
76 double evaluateAction(
double direction,
double velocity,
bool debug =
false);
97 inline sensor_msgs::PointCloud*
getPointCloud(
double direction,
double velocity);
ros::Publisher mPlanPublisher
sensor_msgs::PointCloud * mTrajTable[(LUT_RESOLUTION *4)+2]
costmap_2d::Costmap2DROS * mLocalMap
sensor_msgs::PointCloud * getPointCloud(double direction, double velocity)
Get the trajectory defined by the given movement command.
costmap_2d::Costmap2D * mCostmap
double evaluateAction(double direction, double velocity, bool debug=false)
Calculate the action value of a given command.
tf2_ros::Buffer mTf2Buffer
void initTrajTable()
Initializes look-up tables This calculates the trajectories of all possible direction commands....
int calculateFreeSpace(sensor_msgs::PointCloud *cloud)
Calculates the distance the robot can move following the given trajectory.
tf::TransformListener mTfListener
void receiveCommand(const nav2d_operator::cmd::ConstPtr &msg)
Callback function to receive move commands.
double findBestDirection()
Evaluates all possible directions with a fixed resolution.
unsigned int mRecoverySteps
tf2_ros::TransformListener mTf2Listener
ros::Publisher mTrajectoryPublisher
ros::Subscriber mCommandSubscriber
ros::Publisher mControlPublisher
void executeCommand()
Generates and sends Twist-Message to Robot This is the Operator's core function and should be called ...
ros::Publisher mCostPublisher
std::string mOdometryFrame
nav2d_operator
Author(s): Sebastian Kasperski
autogenerated on Wed Mar 2 2022 00:37:35