Difference between trajectory_planner.cpp and trajectory_planner_ros.cpp
I am currently trying to work with the trajectory planner in `base_local_planner`. But now I am A bit confused, because the two source files `trajectory_planner.cpp` and `trajectory_planner_ros.cpp`...
View Articledoubt regarding working of base_local_planner and oscillations about the...
Hi all, I have a doubt regarding the working of the [base_local_planner](http://wiki.ros.org/base_local_planner), specifically Trajectory Rollout planner. According to the above link, the local...
View Articledoubt regarding working of base_local_planner
Hi all, I have a doubt regarding working of [base_local_planner](http://wiki.ros.org/base_local_planner). As the base_local_planner requires an odometry information (`nav_msgs/Odometry`) to get the...
View ArticleWhy is there a time delay between the map update and re-planning?
Hi everyone, I'm using the navigation stack with the SBPL Lattice Planner (ARA planner) as the global planner and Trajectory planner as the local planner on a robot. The local cost map can see till 2.5...
View ArticleRos Navigation assistance
I am trying to figure out why my Clearpath Ridgeback makes a complete revolution when trying to lock in on some of my locations. It seems to happen at the ones that are furthest from my starting point...
View ArticleLimiting the change of arm to a button press
Hey, I am trying to control my robot arm with an xbox controller and my python code is as follows #!/usr/bin/env python import sys import copy import rospy import moveit_commander from moveit_msgs.msg...
View Articletrajectory cost on base local planner
So i have been digging through the code of base local planner trying to understand how the robots plans its trajectories. What i found was, as its stated in the API documentation the **cost function**...
View Article