-
 

Package Summary

Tags No category tags.
Version 1.13.1
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version noetic-devel
Last Updated 2021-01-11
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

nav_msgs defines the common messages used to interact with the

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package nav_msgs

1.13.1 (2021-01-11)

  • Update package maintainers (#168)
  • Add LoadMap service (#164)
  • Contributors: David V. Lu!!, Michel Hidalgo

1.13.0 (2020-05-21)

  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Shane Loretz

1.12.7 (2018-11-06)

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

1.12.4 (2016-02-22)

1.12.3 (2015-04-20)

1.12.2 (2015-03-21)

  • change type of initial_pose in SetMap service to PoseWithCovarianceStamped
  • Contributors: Stephan Wirth

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Adds a SetMap service message to support swap maps functionality in amcl
  • Contributors: Tully Foote, liz-murphy

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

1.11.5 (2014-10-27)

1.11.4 (2014-06-19)

1.11.3 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Contributors: Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

1.11.0 (2014-03-04)

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • added action definition for getting maps
  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

  • updated to current catkin

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • make find_package REQUIRED
  • removed obsolete catkin tag from manifest files
  • fixed package dependencies for several common messages (fixed #3956)
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • nav_msgs: getting rid of other build files and cleaning up
  • common_msgs: starting catkin conversion
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • More tweaking for standalone message generation
  • Getting standalone message generation working... w/o munging rosbuild2
  • more rosbuild2 hacking
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • removing old exports ros#2292
  • Added Ubuntu platform tags to manifest
  • Adding a start pose to the GetPlan service
  • Remove use of deprecated rosbuild macros
  • Fixing migration rules for nav_msgs.
  • Changed byte to int8, in response to map_server doc review
  • changing review status
  • adding documentation for #2997
  • removing redundant range statements as per ticket:2997
  • Adding documentation to the Odometry message to make things more clear
  • manifest update
  • updated description and url
  • full migration rules
  • adding child_frame_id as per discussion about odometry message
  • Adding a header to Path
  • Adding a header to the GridCells message
  • Adding a new GridCells message for displaying obstacles in nav_view and rviz
  • clearing API reviews for they've been through a bunch of them recently.
  • fixing stack name
  • Adding comments to path
  • documenting messages
  • Making odometry migration fail until we have worked out appropriate way to handle covariances.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • #2250 getting rid of _with_covariance in Odometry fields
  • nav_msgs: added missing srv export
  • Adding migration rules to get migration tests to pass.
  • removing last of robot_msgs and all dependencies on it
  • moving Path from robot_msgs to nav_msgs #2281
  • adding header to OccupancyGrid #1906
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • moving PoseArray into geometry_msgs #1907
  • fixing names
  • Removing header since there's already one in the pose and fixing message definition to have variable names
  • adding Odometry message as per API review and ticket:2250
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes
  • Forgot to check in the services I added.… shoot
  • Moving StaticMap.srv to GetMap.srv and moving Plan.srv to GetPlan.srv, also moving them to nav_msgs and removing the nav_srvs package
  • Merging tha actionlib branch back into trunk r29135@att (orig r19792): eitanme | 2009-07-27 18:30:30 -0700 Creating a branch for actionlib.… hopefully for the last time r29137@att (orig r19794): eitanme | 2009-07-27 18:32:49 -0700 Changing ParticleCloud to PoseArray r29139@att (orig r19796): eitanme | 2009-07-27 18:33:42 -0700 Adding action definition to the rep r29148@att (orig r19805): eitanme | 2009-07-27 18:47:39 -0700 Some fixes... almost compiling r29165@att (orig r19822): eitanme | 2009-07-27 20:41:07 -0700 Macro version of the typedefs that compiles r29213@att (orig r19869): eitanme | 2009-07-28 11:49:10 -0700 Compling version of the ActionServer re-write complete with garbage collection, be default it will keep goals without goal handles for 5 seconds r29220@att (orig r19876): eitanme | 2009-07-28 12:06:06 -0700 Fix to make sure that transitions into preempting and recalling states actually happen r29254@att (orig r19888): eitanme | 2009-07-28 13:27:40 -0700 Forgot to actually call the cancel callback... addind a subscriber on the cancel topic r29267@att (orig r19901): eitanme | 2009-07-28 14:41:09 -0700 Adding text field to GoalStatus to allow users to throw some debugging information into the GoalStatus messages r29275@att (orig r19909): eitanme | 2009-07-28 15:43:49 -0700 Using tf remapping as I should've been doing for awhile r29277@att (orig r19911): eitanme | 2009-07-28 15:48:48 -0700 The navigation stack can now handle goals that aren't in the global frame. However, these goals will be transformed to the global frame at the time of reception, so for achieving them accurately the global frame of move_base should really be set to match the goals. r29299@att (orig r19933): stuglaser | 2009-07-28 17:08:10 -0700 Created genaction.py script to create the various messages that an action needs r29376@att (orig r20003): vijaypradeep | 2009-07-29 02:45:24 -0700 ActionClient is running. MoveBase ActionServer seems to be crashing r29409@att (orig r20033): vijaypradeep | 2009-07-29 11:57:54 -0700 Fixing bug with adding status trackers r29410@att (orig r20034): vijaypradeep | 2009-07-29 11:58:18 -0700 Changing from Release to Debug r29432@att (orig r20056): vijaypradeep | 2009-07-29 14:07:30 -0700 No longer building goal_manager_test.cpp r29472@att (orig r20090): vijaypradeep | 2009-07-29 17:04:14 -0700 Lots of Client-Side doxygen r29484@att (orig r20101): vijaypradeep | 2009-07-29 18:35:01 -0700 Adding to mainpage.dox r29487@att (orig r20104): eitanme | 2009-07-29 18:55:06 -0700 Removing file to help resolve merge I hope r29489@att (orig r20106): eitanme | 2009-07-29 19:00:07 -0700 Removing another file to try to resolve the branch r29492@att (orig r20108): eitanme | 2009-07-29 19:14:25 -0700 Again removing a file to get the merge working r29493@att (orig r20109): eitanme | 2009-07-29 19:34:45 -0700 Removing yet another file on which ssl negotiation fails r29500@att (orig r20116): eitanme | 2009-07-29 19:54:18 -0700 Fixing bug in genaction
  • moving MapMetaData and OccGrid into nav_msgs #1303
  • created nav_msgs and moved ParticleCloud there #1300

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
arbotix_python
ground_dds_ros_bridge
vive_localization
audibot_gazebo
bagger
cob_base_controller_utils
cob_base_velocity_smoother
cob_collision_velocity_filter
cob_hardware_emulation
cob_mecanum_controller
cob_omni_drive_controller
cob_tricycle_controller
cob_twist_controller
cob_undercarriage_ctrl
cob_linear_nav
cob_map_accessibility_analysis
common_msgs
cras_imu_tools
create_driver
fetch_open_auto_dock
fetch_drivers
fetch_depth_layer
fetch_teleop
floam
fuse_models
fuse_optimizers
fuse_publishers
fuse_tutorials
gazebo_plugins
gps_common
graceful_controller_ros
graft
grid_map_ros
grid_map_visualization
hector_gazebo_plugins
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_geotiff
hector_imu_tools
hector_map_server
hector_map_tools
hector_mapping
hector_nav_msgs
hector_trajectory_server
imu_processors
inno_sim_interface
iris_lama_ros
ixblue_ins_driver
rotors_driver
multi_map_server
pr2eus
jsk_pcl_ros
jsk_pcl_ros_utils
kvh_geo_fog_3d_driver
map_laser
leo_fw
leo_gazebo
lsm_localization
explore_lite
multirobot_map_merge
mapviz_plugins
swri_image_util
swri_roscpp
mavros
mcl_3dl
microstrain_inertial_driver
microstrain_inertial_rqt
mir_actions
mir_driver
mobile_robot_simulator
mocap_nokov
mocap_optitrack
mbf_abstract_nav
mbf_costmap_nav
mbf_msgs
mbf_simple_nav
move_base_sequence
move_base_swp
mpc_local_planner
mrpt_localization
mrpt_map
mrpt_rawlog
mrpt_reactivenav2d
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_graphslam_2d
mrpt_icp_slam_2d
mrpt_rbpf_slam
mvsim
naoqi_bridge_msgs
amcl
base_local_planner
costmap_2d
dwa_local_planner
fake_localization
global_planner
map_server
move_base
navfn
nav2d_exploration
nav2d_karto
nav2d_localizer
pose_base_controller
pose_follower
sbpl_lattice_planner
map_msgs
nearfield_map
neo_local_planner
costmap_cspace
map_organizer
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
map_organizer_msgs
trajectory_tracker_msgs
nonpersistent_voxel_layer
novatel_gps_driver
novatel_oem7_driver
octomap_server
route_network
ov_eval
ov_msckf
outsight_alb_driver
oxford_gps_eth
p2os_driver
pose_cov_ops
pr2_mechanism_controllers
pr2_gazebo_plugins
py_trees_ros
rc_visard_driver
ridgeback_control
ridgeback_gazebo_plugins
robot_calibration
robot_controllers
robot_localization
dlux_global_planner
dwb_local_planner
dwb_msgs
global_planner_tests
locomotor
nav_2d_utils
nav_core_adapter
nav_grid_iterators
nav_grid_pub_sub
nav_grid_server
robot_nav_rviz_plugins
robot_pose_ekf
robotont_gazebo
ackermann_steering_controller
diff_drive_controller
four_wheel_steering_controller
ros_numpy
rosbridge_library
rosserial_windows
rqt_nav_view
rtabmap_odom
rtabmap_slam
rtabmap_sync
rtabmap_util
rtabmap_viz
rviz
sbg_driver
laser_scan_matcher
septentrio_gnss_driver
gmapping
slam_karto
slam_toolbox
backward_global_planner
backward_local_planner
forward_global_planner
forward_local_planner
pure_spinning_local_planner
undo_path_global_planner
stage_ros
steering_functions
teb_local_planner
turtlebot3_example
turtlebot3_fake
turtlebot3_gazebo
tuw_local_controller_msgs
tuw_multi_robot_msgs
tuw_nav_msgs
tuw_waypoint_to_spline_msgs
tuw_multi_robot_ctrl
tuw_multi_robot_goal_generator
tuw_multi_robot_local_behavior_controller
tuw_multi_robot_router
tuw_multi_robot_rviz
tuw_voronoi_graph
ubiquity_motor
wifi_ddwrt
witmotion_ros
ypspur_ros
massrobotics_amr_sender
ros_ign_bridge
beluga_ros
clearpath_logger_msgs
clearpath_navigation_msgs
clearpath_onav_api_examples_lib
clober_simulation
ergodic_exploration
fields2cover_ros
flatland_plugins
gmcl
leo_example_follow_ar_tag
bosch_locator_bridge
mrpt_apps
mrpt_libros_bridge
quori_holonomic_drive_controller
quori_mapping_odometry
raspimouse_control
rm_referee
rm_chassis_controllers
rose2
sick_scan_xd
turtlebot3_autorace_detect
turtlebot3_autorace_driving

Recent questions tagged nav_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.8
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/common_msgs.git
VCS Type git
VCS Version jade-devel
Last Updated 2021-01-12
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

nav_msgs defines the common messages used to interact with the

Additional Links

Maintainers

  • Michel Hidalgo

Authors

  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package nav_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Add LoadMap service definition (#152)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Jacob Perron, Michel Hidalgo, Shane Loretz

1.12.7 (2018-11-06)

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

1.12.4 (2016-02-22)

1.12.3 (2015-04-20)

1.12.2 (2015-03-21)

  • change type of initial_pose in SetMap service to PoseWithCovarianceStamped
  • Contributors: Stephan Wirth

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Adds a SetMap service message to support swap maps functionality in amcl
  • Contributors: Tully Foote, liz-murphy

1.12.0 (2014-12-29)

1.11.6 (2014-11-04)

1.11.5 (2014-10-27)

1.11.4 (2014-06-19)

1.11.3 (2014-05-07)

  • Export architecture_independent flag in package.xml
  • Contributors: Scott K Logan

1.11.2 (2014-04-24)

1.11.1 (2014-04-16)

1.11.0 (2014-03-04)

1.10.6 (2014-02-27)

1.10.5 (2014-02-25)

1.10.4 (2014-02-18)

1.10.3 (2014-01-07)

1.10.2 (2013-08-19)

1.10.1 (2013-08-16)

1.10.0 (2013-07-13)

1.9.16 (2013-05-21)

  • added action definition for getting maps
  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

1.9.12 (2013-01-02)

1.9.11 (2012-12-17)

  • modified dep type of catkin

1.9.10 (2012-12-13)

  • add missing downstream depend
  • switched from langs to message* packages

1.9.9 (2012-11-22)

1.9.8 (2012-11-14)

1.9.7 (2012-10-30)

  • fix catkin function order

1.9.6 (2012-10-18)

  • updated cmake min version to 2.8.3, use cmake_parse_arguments instead of custom macro

1.9.5 (2012-09-28)

1.9.4 (2012-09-27 18:06)

1.9.3 (2012-09-27 17:39)

  • cleanup
  • cleaned up package.xml files
  • updated to latest catkin
  • fixed dependencies and more
  • updated to latest catkin: created package.xmls, updated CmakeLists.txt

1.9.2 (2012-09-05)

  • updated pkg-config in manifest.xml

1.9.1 (2012-09-04)

  • use install destination variables, removed manual installation of manifests

1.9.0 (2012-08-29)

  • updated to current catkin

1.8.13 (2012-07-26 18:34:15 +0000)

1.8.8 (2012-06-12 22:36)

  • make find_package REQUIRED
  • removed obsolete catkin tag from manifest files
  • fixed package dependencies for several common messages (fixed #3956)
  • adding manifest exports
  • removed depend, added catkin
  • stripping depend and export tags from common_msgs manifests as msg dependencies are now declared in cmake and stack.yaml. Also removed bag migration exports
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • nav_msgs: getting rid of other build files and cleaning up
  • common_msgs: starting catkin conversion
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • More tweaking for standalone message generation
  • Getting standalone message generation working... w/o munging rosbuild2
  • more rosbuild2 hacking
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • removing old exports ros#2292
  • Added Ubuntu platform tags to manifest
  • Adding a start pose to the GetPlan service
  • Remove use of deprecated rosbuild macros
  • Fixing migration rules for nav_msgs.
  • Changed byte to int8, in response to map_server doc review
  • changing review status
  • adding documentation for #2997
  • removing redundant range statements as per ticket:2997
  • Adding documentation to the Odometry message to make things more clear
  • manifest update
  • updated description and url
  • full migration rules
  • adding child_frame_id as per discussion about odometry message
  • Adding a header to Path
  • Adding a header to the GridCells message
  • Adding a new GridCells message for displaying obstacles in nav_view and rviz
  • clearing API reviews for they've been through a bunch of them recently.
  • fixing stack name
  • Adding comments to path
  • documenting messages
  • Making odometry migration fail until we have worked out appropriate way to handle covariances.
  • Changing naming of bag migration rules.
  • Modifying migration rules for Odometry and WrenchStamped change of field names.
  • Adding actual migration rules for all of the tested common_msgs migrations.
  • #2250 getting rid of _with_covariance in Odometry fields
  • nav_msgs: added missing srv export
  • Adding migration rules to get migration tests to pass.
  • removing last of robot_msgs and all dependencies on it
  • moving Path from robot_msgs to nav_msgs #2281
  • adding header to OccupancyGrid #1906
  • First half of the change from deprecated_msgs::RobotBase2DOdom to nav_msgs::Odometry, I think all the c++ compiles, can't speak for functionality yet, also... the python has yet to be run... this may break some things
  • moving PoseArray into geometry_msgs #1907
  • fixing names
  • Removing header since there's already one in the pose and fixing message definition to have variable names
  • adding Odometry message as per API review and ticket:2250
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes
  • Forgot to check in the services I added.… shoot
  • Moving StaticMap.srv to GetMap.srv and moving Plan.srv to GetPlan.srv, also moving them to nav_msgs and removing the nav_srvs package
  • Merging tha actionlib branch back into trunk r29135@att (orig r19792): eitanme | 2009-07-27 18:30:30 -0700 Creating a branch for actionlib.… hopefully for the last time r29137@att (orig r19794): eitanme | 2009-07-27 18:32:49 -0700 Changing ParticleCloud to PoseArray r29139@att (orig r19796): eitanme | 2009-07-27 18:33:42 -0700 Adding action definition to the rep r29148@att (orig r19805): eitanme | 2009-07-27 18:47:39 -0700 Some fixes... almost compiling r29165@att (orig r19822): eitanme | 2009-07-27 20:41:07 -0700 Macro version of the typedefs that compiles r29213@att (orig r19869): eitanme | 2009-07-28 11:49:10 -0700 Compling version of the ActionServer re-write complete with garbage collection, be default it will keep goals without goal handles for 5 seconds r29220@att (orig r19876): eitanme | 2009-07-28 12:06:06 -0700 Fix to make sure that transitions into preempting and recalling states actually happen r29254@att (orig r19888): eitanme | 2009-07-28 13:27:40 -0700 Forgot to actually call the cancel callback... addind a subscriber on the cancel topic r29267@att (orig r19901): eitanme | 2009-07-28 14:41:09 -0700 Adding text field to GoalStatus to allow users to throw some debugging information into the GoalStatus messages r29275@att (orig r19909): eitanme | 2009-07-28 15:43:49 -0700 Using tf remapping as I should've been doing for awhile r29277@att (orig r19911): eitanme | 2009-07-28 15:48:48 -0700 The navigation stack can now handle goals that aren't in the global frame. However, these goals will be transformed to the global frame at the time of reception, so for achieving them accurately the global frame of move_base should really be set to match the goals. r29299@att (orig r19933): stuglaser | 2009-07-28 17:08:10 -0700 Created genaction.py script to create the various messages that an action needs r29376@att (orig r20003): vijaypradeep | 2009-07-29 02:45:24 -0700 ActionClient is running. MoveBase ActionServer seems to be crashing r29409@att (orig r20033): vijaypradeep | 2009-07-29 11:57:54 -0700 Fixing bug with adding status trackers r29410@att (orig r20034): vijaypradeep | 2009-07-29 11:58:18 -0700 Changing from Release to Debug r29432@att (orig r20056): vijaypradeep | 2009-07-29 14:07:30 -0700 No longer building goal_manager_test.cpp r29472@att (orig r20090): vijaypradeep | 2009-07-29 17:04:14 -0700 Lots of Client-Side doxygen r29484@att (orig r20101): vijaypradeep | 2009-07-29 18:35:01 -0700 Adding to mainpage.dox r29487@att (orig r20104): eitanme | 2009-07-29 18:55:06 -0700 Removing file to help resolve merge I hope r29489@att (orig r20106): eitanme | 2009-07-29 19:00:07 -0700 Removing another file to try to resolve the branch r29492@att (orig r20108): eitanme | 2009-07-29 19:14:25 -0700 Again removing a file to get the merge working r29493@att (orig r20109): eitanme | 2009-07-29 19:34:45 -0700 Removing yet another file on which ssl negotiation fails r29500@att (orig r20116): eitanme | 2009-07-29 19:54:18 -0700 Fixing bug in genaction
  • moving MapMetaData and OccGrid into nav_msgs #1303
  • created nav_msgs and moved ParticleCloud there #1300

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
arbotix_python
asr_ftc_local_planner
asr_mild_base_driving
asr_mild_base_fake_driving
asr_mild_base_laserscanner
asr_navfn
ground_dds_ros_bridge
vive_localization
audibot_gazebo
bagger
cartographer_ros
cob_base_controller_utils
cob_base_velocity_smoother
cob_collision_velocity_filter
cob_hardware_emulation
cob_mecanum_controller
cob_omni_drive_controller
cob_tricycle_controller
cob_twist_controller
cob_undercarriage_ctrl
cob_linear_nav
cob_map_accessibility_analysis
common_msgs
message_relay
cras_imu_tools
create_driver
datmo
distance_map_core
distance_map_msgs
eband_local_planner
fetch_open_auto_dock
fetch_drivers
fetch_depth_layer
fetch_teleop
floam
fuse_models
fuse_optimizers
fuse_publishers
fuse_tutorials
gazebo_plugins
gps_common
graceful_controller_ros
graft
grid_map_ros
grid_map_visualization
hector_gazebo_plugins
hector_pose_estimation
hector_pose_estimation_core
message_to_tf
hector_compressed_map_transport
hector_geotiff
hector_imu_tools
hector_map_server
hector_map_tools
hector_mapping
hector_nav_msgs
hector_trajectory_server
heifu_safety
heron_controller
heron_gazebo
imu_processors
inno_sim_interface
iris_lama_ros
ixblue_ins_driver
jointstick
multi_map_server
pr2eus
jsk_pcl_ros
jsk_pcl_ros_utils
kobuki_auto_docking
kobuki_node
kobuki_gazebo_plugins
kobuki_qtestsuite
kvh_geo_fog_3d_driver
map_laser
leo_gazebo
lsm_localization
explore_lite
multirobot_map_merge
mapviz_plugins
swri_image_util
swri_roscpp
mav_msgs
mavros
mcl_3dl
microstrain_inertial_driver
microstrain_inertial_rqt
microstrain_mips
mir_actions
mir_driver
mobile_robot_simulator
mocap_nokov
mocap_optitrack
moose_control
mbf_abstract_nav
mbf_costmap_nav
mbf_msgs
mbf_simple_nav
move_base_sequence
move_base_swp
mpc_local_planner
mrp2_hardware
mrpt_localization
mrpt_map
mrpt_rawlog
mrpt_reactivenav2d
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_icp_slam_2d
mrpt_rbpf_slam
mvsim
naoqi_bridge_msgs
amcl
base_local_planner
costmap_2d
dwa_local_planner
fake_localization
global_planner
map_server
move_base
navfn
nav2d_exploration
nav2d_karto
nav2d_localizer
pose_base_controller
pose_follower
sbpl_lattice_planner
map_msgs
odometry_publisher_tutorial
nearfield_map
neo_local_planner
costmap_cspace
map_organizer
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
map_organizer_msgs
trajectory_tracker_msgs
nonpersistent_voxel_layer
novatel_gps_driver
novatel_oem7_driver
novatel_msgs
octomap_server
omnibase_control
open_manipulator_with_tb3_tools
route_network
ov_eval
ov_msckf
outsight_alb_driver
oxford_gps_eth
p2os_driver
dummy_slam_broadcaster
pipeline_planner
pose_cov_ops
pr2_mechanism_controllers
pr2_gazebo_plugins
py_trees_ros
rc_cloud_accumulator
rc_visard_driver
ridgeback_control
ridgeback_gazebo_plugins
robot_calibration
robot_controllers
robot_localization
dlux_global_planner
dwb_local_planner
dwb_msgs
global_planner_tests
locomotor
nav_2d_utils
nav_core_adapter
nav_grid_iterators
nav_grid_pub_sub
nav_grid_server
robot_nav_rviz_plugins
robot_pose_ekf
rsm_additions
robotont_gazebo
ackermann_steering_controller
diff_drive_controller
four_wheel_steering_controller
ros_numpy
rosbridge_library
rosserial_windows
rotors_control
rqt_nav_view
rr_openrover_driver
rr_rover_zero_driver
rtabmap_ros
hrpsys_ros_bridge
rviz
sbg_driver
laser_scan_matcher
seed_r7_gazebo
seed_r7_navigation
seed_r7_ros_controller
septentrio_gnss_driver
gmapping
slam_karto
slam_toolbox
backward_global_planner
backward_local_planner
forward_global_planner
forward_local_planner
pure_spinning_local_planner
undo_path_global_planner
stage_ros
steering_functions
teb_local_planner
turtlebot3_example
turtlebot3_automatic_parking
turtlebot3_automatic_parking_vision
turtlebot3_follower
turtlebot3_panorama
turtlebot3_autorace_control
turtlebot3_autorace_detect
turtlebot3_fake
turtlebot3_gazebo
tuw_local_controller_msgs
tuw_multi_robot_msgs
tuw_nav_msgs
tuw_waypoint_to_spline_msgs
tuw_multi_robot_ctrl
tuw_multi_robot_goal_generator
tuw_multi_robot_local_behavior_controller
tuw_multi_robot_router
tuw_multi_robot_rviz
tuw_voronoi_graph
ubiquity_motor
underwater_vehicle_dynamics
uwsim
uuv_assistants
uuv_control_cascaded_pid
uuv_control_utils
uuv_trajectory_control
vesc_ackermann
volksbot_driver
wifi_ddwrt
witmotion_ros
ypspur_ros
yocs_navi_toolkit
yocs_navigator
yocs_velocity_smoother
yocs_waypoints_navi

Recent questions tagged nav_msgs at Robotics Stack Exchange