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

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

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

Changelog for package geometry_msgs

1.13.1 (2021-01-11)

  • Update package maintainers (#168)
  • Contributors: 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)

  • Add deprecation comment about Pose2D (#130) It started as unused and still isn\'t recommended. Followup to #129
  • Contributors: Tully Foote

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

  • Fix spelling mistakes
  • Contributors: trorornmn

1.12.4 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.12.3 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.12.2 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Contributors: Tully Foote

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)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

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)

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

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • 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
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they\'ve been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it\'s deprecated.
  • 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.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector \'using\' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to \'data\' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • 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
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn\'t stand on it\'s own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

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 Repo Deps
ainstein_radar_msgs github-AinsteinAI-ainstein_radar
amr_interop_bridge github-LexxPluss-amr_interop_bridge
amr_interop_msgs github-LexxPluss-amr_interop_bridge
apriltag_ros github-AprilRobotics-apriltag_ros
arbotix_python github-vanadiumlabs-arbotix_ros
aruco_msgs github-pal-robotics-aruco_ros
aruco_ros github-pal-robotics-aruco_ros
dock github-nasa-astrobee
perch github-nasa-astrobee
ff_msgs github-nasa-astrobee
handrail_detect github-nasa-astrobee
marker_tracking github-nasa-astrobee
vive_localization github-nasa-astrobee
framestore github-nasa-astrobee
msg_conversions github-nasa-astrobee
derived_object_msgs github-astuff-astuff_sensor_msgs
automotive_navigation_msgs github-astuff-automotive_autonomy_msgs
autoware_msgs github-autoware-ai-messages
auv_msgs github-oceansystemslab-auv_msgs
axis_camera github-ros-drivers-axis_camera
bagger github-squarerobot-bagger
bota_driver_testing gitlab-botasys-bota_driver
rokubimini gitlab-botasys-bota_driver
rokubimini_msgs gitlab-botasys-bota_driver
calibration_msgs github-ros-perception-calibration
image_cb_detector github-ros-perception-calibration
interval_intersection github-ros-perception-calibration
capabilities github-osrf-capabilities
carla_msgs github-carla-simulator-ros-carla-msgs
cartesian_control_msgs github-UniversalRobots-Universal_Robots_ROS_cartesian_control_msgs
cartesian_msgs github-PickNikRobotics-cartesian_msgs
cob_script_server github-4am-robotics-cob_command_tools
cob_teleop github-4am-robotics-cob_command_tools
scenario_test_tools github-4am-robotics-cob_command_tools
cob_actions github-4am-robotics-cob_common
cob_srvs github-4am-robotics-cob_common
cob_base_controller_utils github-4am-robotics-cob_control
cob_base_velocity_smoother github-4am-robotics-cob_control
cob_cartesian_controller github-4am-robotics-cob_control
cob_collision_velocity_filter github-4am-robotics-cob_control
cob_control_msgs github-4am-robotics-cob_control
cob_footprint_observer github-4am-robotics-cob_control
cob_frame_tracker github-4am-robotics-cob_control
cob_mecanum_controller github-4am-robotics-cob_control
cob_model_identifier github-4am-robotics-cob_control
cob_obstacle_distance github-4am-robotics-cob_control
cob_omni_drive_controller github-4am-robotics-cob_control
cob_tricycle_controller github-4am-robotics-cob_control
cob_twist_controller github-4am-robotics-cob_control
cob_undercarriage_ctrl github-4am-robotics-cob_driver
cob_grasp_generation github-ipa320-cob_manipulation
cob_lookat_action github-ipa320-cob_manipulation
cob_moveit_interface github-ipa320-cob_manipulation
cob_obstacle_distance_moveit github-ipa320-cob_manipulation
cob_linear_nav github-ipa320-cob_navigation
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_3d_mapping_msgs github-ipa320-cob_perception_common
cob_image_flip github-ipa320-cob_perception_common
cob_object_detection_msgs github-ipa320-cob_perception_common
cob_perception_msgs github-ipa320-cob_perception_common
cob_gazebo_tools github-ipa320-cob_simulation
common_msgs github-ros-common_msgs
nav_msgs github-ros-common_msgs
sensor_msgs github-ros-common_msgs
shape_msgs github-ros-common_msgs
trajectory_msgs github-ros-common_msgs
visualization_msgs github-ros-common_msgs
turtle_actionlib github-ros-common_tutorials
computer_status_msgs github-kinu-garage-computer_status_msgs
control_msgs github-ros-controls-control_msgs
costmap_converter github-rst-tu-dortmund-costmap_converter
crane_x7_examples github-rt-net-crane_x7_ros
cras_imu_tools github-ctu-vras-cras_imu_tools
cras_cpp_common github-ctu-vras-ros-utils
cras_py_common github-ctu-vras-ros-utils
cras_topic_tools github-ctu-vras-ros-utils
tf_static_publisher github-ctu-vras-ros-utils
create_driver github-AutonomyLab-create_robot
criutils github-crigroup-criutils
dataspeed_ulc_can bitbucket-DataspeedInc-dataspeed_ulc_ros
dbw_fca_can bitbucket-DataspeedInc-dbw_fca_ros
dbw_fca_msgs bitbucket-DataspeedInc-dbw_fca_ros
dbw_mkz_can bitbucket-dataspeedinc-dbw_mkz_ros
dbw_mkz_msgs bitbucket-dataspeedinc-dbw_mkz_ros
dbw_polaris_can bitbucket-DataspeedInc-dbw_polaris_ros
dbw_polaris_msgs bitbucket-DataspeedInc-dbw_polaris_ros
depthai_ros_msgs github-luxonis-depthai-ros
dual_quaternions_ros github-Achllle-dual_quaternions_ros
dynamixel_workbench_controllers github-ROBOTIS-GIT-dynamixel-workbench
dynamixel_workbench_operators github-ROBOTIS-GIT-dynamixel-workbench
ensenso_camera github-ensenso-ros_driver
ensenso_camera_msgs github-ensenso-ros_driver
er_public_msgs github-enabled-robotics-er_public_msgs
ess_imu_ros1_uart_driver github-cubicleguy-ess_imu_ros1_uart_driver
exotica_core_task_maps github-ipab-slmc-exotica
exotica_core github-ipab-slmc-exotica
exotica_examples github-ipab-slmc-exotica
exotica_python github-ipab-slmc-exotica
fetch_auto_dock_msgs github-fetchrobotics-fetch_msgs
fetch_driver_msgs github-fetchrobotics-fetch_msgs
fetch_open_auto_dock github-fetchrobotics-fetch_open_auto_dock
fetch_depth_layer github-fetchrobotics-fetch_ros
fetch_teleop github-fetchrobotics-fetch_ros
fiducial_msgs github-UbiquityRobotics-fiducials
stag_detect github-UbiquityRobotics-fiducials
find_object_2d github-introlab-find-object
flexbe_states github-flexbe-flexbe_behavior_engine
floam github-flynneva-floam
foxglove_msgs github-foxglove-schemas
frame_editor github-ipa320-rqt_frame_editor_plugin
franka_control github-frankaemika-franka_ros
franka_example_controllers github-frankaemika-franka_ros
franka_gazebo github-frankaemika-franka_ros
fuse_constraints github-locusrobotics-fuse
fuse_core github-locusrobotics-fuse
fuse_models github-locusrobotics-fuse
fuse_optimizers github-locusrobotics-fuse
fuse_publishers github-locusrobotics-fuse
fuse_viz github-locusrobotics-fuse
gazebo_msgs github-ros-simulation-gazebo_ros_pkgs
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geodesy github-ros-geographic-info-geographic_info
geographic_msgs github-ros-geographic-info-geographic_info
eigen_conversions github-ros-geometry
kdl_conversions github-ros-geometry
tf github-ros-geometry
tf_conversions github-ros-geometry
tf2 github-ros-geometry2
tf2_bullet github-ros-geometry2
tf2_eigen github-ros-geometry2
tf2_geometry_msgs github-ros-geometry2
tf2_msgs github-ros-geometry2
tf2_ros github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
turtle_tf github-ros-geometry_tutorials
turtle_tf2 github-ros-geometry_tutorials
graceful_controller_ros github-mikeferguson-graceful_controller
graft github-ros-perception-graft
graph_msgs github-PickNikRobotics-graph_msgs
grasping_msgs github-mikeferguson-grasping_msgs
grid_map_demos github-anybotics-grid_map
grid_map_msgs github-anybotics-grid_map
grid_map_ros github-anybotics-grid_map
haf_grasping github-davidfischinger-haf_grasping
handeye github-crigroup-handeye
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
message_to_tf github-tu-darmstadt-ros-pkg-hector_localization
hector_compressed_map_transport github-tu-darmstadt-ros-pkg-hector_slam
hector_imu_tools github-tu-darmstadt-ros-pkg-hector_slam
hector_nav_msgs github-tu-darmstadt-ros-pkg-hector_slam
hfl_driver github-continental-hfl_driver
image_rotate github-ros-perception-image_pipeline
imu_processors github-ros-perception-imu_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_complementary_filter github-CCNYRoboticsLab-imu_tools
imu_filter_madgwick github-CCNYRoboticsLab-imu_tools
inno_sim_interface github-InnopolisAero-inno_sim_interface
innopolis_vtol_dynamics github-InnopolisAero-inno_vtol_dynamics
iris_lama_ros github-iris-ua-iris_lama_ros
ixblue_ins_msgs github-ixblue-ixblue_ins_stdbin_driver
drone_wrapper github-JdeRobot-drones
rotors_driver github-JdeRobot-drones
rqt_drone_teleop github-JdeRobot-drones
rqt_ground_robot_teleop github-JdeRobot-drones
tello_driver github-JdeRobot-drones
spacenav_node github-ros-drivers-joystick_drivers
wiimote github-ros-drivers-joystick_drivers
respeaker_ros github-jsk-ros-pkg-jsk_3rdparty
respeaker_ros github-Quori-ROS-quori_ros
dynamic_tf_publisher github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
jsk_topic_tools github-jsk-ros-pkg-jsk_common
virtual_force_publisher github-jsk-ros-pkg-jsk_common
jsk_footstep_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_gui_msgs github-jsk-ros-pkg-jsk_common_msgs
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
cmd_vel_smoother github-jsk-ros-pkg-jsk_control
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
audio_to_spectrogram github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_msgs github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
roseus github-jsk-ros-pkg-jsk_roseus
jsk_interactive github-jsk-ros-pkg-jsk_visualization
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
kvh_geo_fog_3d_driver github-MITRE-kvh_geo_fog_3d
leo_bringup github-LeoRover-leo_robot
leo_gazebo github-LeoRover-leo_simulator
lgsvl_msgs github-lgsvl-lgsvl_msgs
hri github-ros4hri-libhri
lsm_localization github-ihadzic-lsm_localization
explore_lite github-hrnr-m-explore
multirobot_map_merge github-hrnr-m-explore
multires_image github-swri-robotics-mapviz
marker_msgs github-tuw-robotics-marker_msgs
swri_image_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
marti_nav_msgs github-swri-robotics-marti_messages
marti_sensor_msgs github-swri-robotics-marti_messages
marti_visualization_msgs github-swri-robotics-marti_messages
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
mavros_msgs github-mavlink-mavros
test_mavros github-mavlink-mavros
mcl_3dl github-at-wat-mcl_3dl
microstrain_inertial_driver github-LORD-MicroStrain-microstrain_inertial
microstrain_inertial_msgs github-LORD-MicroStrain-microstrain_inertial
microstrain_inertial_rqt github-LORD-MicroStrain-microstrain_inertial
mir_actions github-DFKI-NI-mir_robot
mir_driver github-DFKI-NI-mir_robot
mir_dwb_critics github-DFKI-NI-mir_robot
mir_msgs github-DFKI-NI-mir_robot
mobile_robot_simulator github-nobleo-mobile_robot_simulator
mocap_nokov github-NOKOV-MOCAP-mocap_nokov
mocap_optitrack github-ros-drivers-mocap_optitrack
mongodb_store github-strands-project-mongodb_store
mbf_abstract_core github-magazino-move_base_flex
mbf_abstract_nav github-magazino-move_base_flex
mbf_costmap_core github-magazino-move_base_flex
mbf_costmap_nav github-magazino-move_base_flex
mbf_msgs github-magazino-move_base_flex
mbf_simple_nav github-magazino-move_base_flex
mbf_utility github-magazino-move_base_flex
move_base_sequence github-MarkNaeem-move_base_sequence
move_base_swp github-ihadzic-move_base_swp
move_basic github-UbiquityRobotics-move_basic
moveit_commander github-ros-planning-moveit
moveit_core github-ros-planning-moveit
moveit_servo github-ros-planning-moveit
moveit_ros_planning_interface github-ros-planning-moveit
moveit_msgs github-ros-planning-moveit_msgs
moveit_python github-mikeferguson-moveit_python
moveit_visual_tools github-ros-planning-moveit_visual_tools
mpc_local_planner github-rst-tu-dortmund-mpc_local_planner
mrpt_msgs github-mrpt-ros-pkg-mrpt_msgs
mrpt_msgs_bridge github-mrpt-ros-pkg-mrpt_navigation
mrpt_reactivenav2d github-mrpt-ros-pkg-mrpt_navigation
mrpt_sensorlib github-mrpt-ros-pkg-mrpt_sensors
mrpt_graphslam_2d github-mrpt-ros-pkg-mrpt_slam
multisense_ros github-carnegierobotics-multisense_ros
naoqi_bridge_msgs github-ros-naoqi-naoqi_bridge_msgs
naoqi_driver github-ros-naoqi-naoqi_driver
amcl github-ros-planning-navigation
base_local_planner github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
global_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
nav_core github-ros-planning-navigation
navfn github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nav2d_exploration github-skasperski-navigation_2d
nav2d_karto github-skasperski-navigation_2d
nav2d_localizer github-skasperski-navigation_2d
nav2d_msgs github-skasperski-navigation_2d
nav2d_navigator github-skasperski-navigation_2d
assisted_teleop github-ros-planning-navigation_experimental
pose_base_controller github-ros-planning-navigation_experimental
sbpl_lattice_planner github-ros-planning-navigation_experimental
twist_recovery github-ros-planning-navigation_experimental
move_base_msgs github-ros-planning-navigation_msgs
nearfield_map github-TUC-ProAut-ros_nearfield_map
costmap_cspace github-at-wat-neonavigation
joystick_interrupt github-at-wat-neonavigation
map_organizer github-at-wat-neonavigation
obj_to_pointcloud github-at-wat-neonavigation
planner_cspace github-at-wat-neonavigation
safety_limiter github-at-wat-neonavigation
track_odometry github-at-wat-neonavigation
trajectory_tracker github-at-wat-neonavigation
costmap_cspace_msgs github-at-wat-neonavigation_msgs
planner_cspace_msgs github-at-wat-neonavigation_msgs
trajectory_tracker_msgs github-at-wat-neonavigation_msgs
nmea_navsat_driver github-ros-drivers-nmea_navsat_driver
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
object_recognition_msgs github-wg-perception-object_recognition_msgs
octomap_msgs github-OctoMap-octomap_msgs
octomap_pa_msgs github-TUC-ProAut-ros_octomap
open_manipulator_msgs github-ROBOTIS-GIT-open_manipulator_msgs
osm_cartography github-ros-geographic-info-open_street_map
route_network github-ros-geographic-info-open_street_map
ov_eval github-rpng-open_vins
ov_msckf github-rpng-open_vins
outsight_alb_driver gitlab-outsight-public-outsight-drivers-outsight_alb_driver
oxford_gps_eth bitbucket-DataspeedInc-oxford_gps_eth
p2os_driver github-allenh1-p2os
p2os_teleop github-allenh1-p2os
p2os_urdf github-allenh1-p2os
pass_through_controllers github-UniversalRobots-Universal_Robots_ROS_passthrough_controllers
face_detector github-wg-perception-people
leg_detector github-wg-perception-people
people_msgs github-wg-perception-people
people_tracking_filter github-wg-perception-people
people_velocity_tracker github-wg-perception-people
pcl_ros github-ros-perception-perception_pcl
pilz_control github-PilzDE-pilz_robots
pose_cov_ops github-mrpt-ros-pkg-pose_cov_ops
pr2_teleop github-pr2-pr2_apps
pr2_teleop_general github-pr2-pr2_apps
pr2_msgs github-pr2-pr2_common
pr2_arm_move_ik github-pr2-pr2_common_actions
pr2_common_action_msgs github-pr2-pr2_common_actions
pr2_controllers_msgs github-pr2-pr2_controllers
pr2_head_action github-pr2-pr2_controllers
pr2_mechanism_controllers github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
fingertip_pressure github-pr2-pr2_ethercat_drivers
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_hardware_interface github-pr2-pr2_mechanism
pr2_navigation_perception github-PR2-pr2_navigation
pr2_gazebo github-PR2-pr2_simulator
pr2_gazebo_plugins github-PR2-pr2_simulator
psen_scan_v2 github-PilzDE-psen_scan_v2
py_trees_ros github-splintered-reality-py_trees_ros
qb_chain_controllers bitbucket-qbrobotics-qbchain-ros
qb_chain_msgs bitbucket-qbrobotics-qbchain-ros
radar_pa github-TUC-ProAut-ros_radar
pdu_msgs github-NewEagleRaptor-raptor-dbw-ros
raptor_dbw_can github-NewEagleRaptor-raptor-dbw-ros
raptor_dbw_msgs github-NewEagleRaptor-raptor-dbw-ros
rc_genicam_driver github-roboception-rc_genicam_driver_ros
rc_reason_msgs github-roboception-rc_reason_clients_ros
rc_hand_eye_calibration_client github-roboception-rc_visard_ros
rc_pick_client github-roboception-rc_visard_ros
rc_silhouettematch_client github-roboception-rc_visard_ros
rc_tagdetect_client github-roboception-rc_visard_ros
rc_visard_driver github-roboception-rc_visard_ros
ridgeback_gazebo_plugins github-ridgeback-ridgeback_simulator
robot_body_filter github-peci1-robot_body_filter
robot_calibration github-mikeferguson-robot_calibration
robot_calibration_msgs github-mikeferguson-robot_calibration
robot_controllers github-fetchrobotics-robot_controllers
robot_localization github-cra-ros-pkg-robot_localization
dlux_global_planner github-locusrobotics-robot_navigation
dwb_critics github-locusrobotics-robot_navigation
dwb_local_planner github-locusrobotics-robot_navigation
dwb_msgs github-locusrobotics-robot_navigation
locomotor github-locusrobotics-robot_navigation
nav_2d_msgs github-locusrobotics-robot_navigation
nav_2d_utils github-locusrobotics-robot_navigation
nav_core_adapter github-locusrobotics-robot_navigation
nav_grid_pub_sub github-locusrobotics-robot_navigation
robot_nav_rviz_plugins github-locusrobotics-robot_navigation
robot_nav_viz_demos github-locusrobotics-robot_navigation
rqt_dwb_plugin github-locusrobotics-robot_navigation
robot_pose_ekf github-ros-planning-robot_pose_ekf
ros_babel_fish github-StefanFabian-ros_babel_fish
ros_babel_fish_test_msgs github-StefanFabian-ros_babel_fish
ackermann_steering_controller github-ros-controls-ros_controllers
diff_drive_controller github-ros-controls-ros_controllers
force_torque_sensor_controller github-ros-controls-ros_controllers
four_wheel_steering_controller github-ros-controls-ros_controllers
cartesian_interface github-UniversalRobots-Universal_Robots_ROS_controllers_cartesian
twist_controller github-UniversalRobots-Universal_Robots_ROS_controllers_cartesian
inorbit_republisher github-inorbit-ai-ros_inorbit_samples
ros_numpy github-eric-wieser-ros_numpy
turtlesim github-ros-ros_tutorials
rosbridge_library github-RobotWebTools-rosbridge_suite
roscompile github-DLu-roscompile
rosee_msg github-ADVRHumanoids-rosee_msg
cl_transforms_stamped github-ros-roslisp_common
rosmsg_cpp github-ctu-vras-rosmsg_cpp
rospilot github-rospilot-rospilot
rosserial_windows github-ros-drivers-rosserial
rqt_bag_plugins github-ros-visualization-rqt_bag
rqt_ez_publisher github-OTL-rqt_ez_publisher
rqt_image_view github-ros-visualization-rqt_image_view
rqt_nav_view github-ros-visualization-rqt_nav_view
rqt_pose_view github-ros-visualization-rqt_pose_view
rqt_py_trees github-stonier-rqt_py_trees
rqt_robot_steering github-ros-visualization-rqt_robot_steering
rtabmap_conversions github-introlab-rtabmap_ros
rtabmap_msgs github-introlab-rtabmap_ros
rtabmap_slam github-introlab-rtabmap_ros
rtabmap_viz github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
rviz_animated_view_controller github-ros-visualization-rviz_animated_view_controller
rviz_visual_tools github-PickNikRobotics-rviz_visual_tools
sbg_driver github-SBG-Systems-sbg_ros_driver
laser_ortho_projector github-CCNYRoboticsLab-scan_tools
laser_scan_matcher github-CCNYRoboticsLab-scan_tools
polar_scan_matcher github-CCNYRoboticsLab-scan_tools
sciurus17_examples github-rt-net-sciurus17_ros
sciurus17_msgs github-rt-net-sciurus17_ros
sciurus17_vision github-rt-net-sciurus17_ros
septentrio_gnss_driver github-septentrio-gnss-septentrio_gnss_driver
sick_ldmrs_msgs github-SICKAG-sick_ldmrs_laser
simple_grasping github-mikeferguson-simple_grasping
slam_toolbox_msgs github-SteveMacenski-slam_toolbox
backward_global_planner github-robosoft-ai-smacc
backward_local_planner github-robosoft-ai-smacc
forward_global_planner github-robosoft-ai-smacc
forward_local_planner github-robosoft-ai-smacc
pure_spinning_local_planner github-robosoft-ai-smacc
undo_path_global_planner github-robosoft-ai-smacc
snowbot_operating_system github-PickNikRobotics-snowbot_operating_system
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
stag_ros github-usrl-uofsc-stag_ros
stage_ros github-ros-simulation-stage_ros
steering_functions github-hbanzhaf-steering_functions
teb_local_planner github-rst-tu-dortmund-teb_local_planner
teleop_legged_robots github-SoftServeSAG-teleop_legged_robots
key_teleop github-ros-teleop-teleop_tools
mouse_teleop github-ros-teleop-teleop_tools
teleop_twist_joy github-ros-teleop-teleop_twist_joy
teleop_twist_keyboard github-ros-teleop-teleop_twist_keyboard
tf2_server github-peci1-tf2_server
tf2_web_republisher github-RobotWebTools-tf2_web_republisher
turtlebot3_example github-ROBOTIS-GIT-turtlebot3
turtlebot3_teleop github-ROBOTIS-GIT-turtlebot3
turtlebot3_fake github-ROBOTIS-GIT-turtlebot3_simulations
turtlebot3_gazebo github-ROBOTIS-GIT-turtlebot3_simulations
tuw_airskin_msgs github-tuw-robotics-tuw_msgs
tuw_gazebo_msgs github-tuw-robotics-tuw_msgs
tuw_geometry_msgs github-tuw-robotics-tuw_msgs
tuw_local_controller_msgs github-tuw-robotics-tuw_msgs
tuw_multi_robot_msgs github-tuw-robotics-tuw_msgs
tuw_nav_msgs github-tuw-robotics-tuw_msgs
tuw_object_msgs github-tuw-robotics-tuw_msgs
tuw_vehicle_msgs github-tuw-robotics-tuw_msgs
tuw_multi_robot_ctrl github-tuw-robotics-tuw_multi_robot
tuw_multi_robot_local_behavior_controller github-tuw-robotics-tuw_multi_robot
tuw_multi_robot_router github-tuw-robotics-tuw_multi_robot
tuw_voronoi_graph github-tuw-robotics-tuw_multi_robot
twist_mux github-ros-teleop-twist_mux
uavcan_communicator github-InnopolisAero-uavcan_communicator
ubiquity_motor github-UbiquityRobotics-ubiquity_motor
ur_kinematics github-ros-industrial-universal_robot
ur_msgs github-ros-industrial-ur_msgs
ur_robot_driver github-UniversalRobots-Universal_Robots_ROS_Driver
variant_topic_tools github-anybotics-variant
view_controller_msgs github-ros-visualization-view_controller_msgs
vision_msgs github-Kukanani-vision_msgs
visp_auto_tracker github-lagadic-vision_visp
visp_bridge github-lagadic-vision_visp
visp_camera_calibration github-lagadic-vision_visp
visp_hand2eye_calibration github-lagadic-vision_visp
visp_tracker github-lagadic-vision_visp
visp_ros github-lagadic-visp_ros
rwt_nav github-tork-a-visualization_rwt
rwt_plot github-tork-a-visualization_rwt
volta_teleoperator github-botsync-volta
vrpn_client_ros github-ros-drivers-vrpn_client_ros
warehouse_ros github-ros-planning-warehouse_ros
wifi_ddwrt github-ros-drivers-wifi_ddwrt
witmotion_ros github-ElettraSciComp-witmotion_IMU_ros
easy_markers github-DLu-wu_ros_tools
xpp_msgs github-leggedrobotics-xpp
ypspur_ros github-openspur-ypspur_ros
z_laser_gui github-fada-catec-z_laser_projector
z_laser_msgs github-fada-catec-z_laser_projector
z_laser_viz github-fada-catec-z_laser_projector
darknet_ros_msgs github-leggedrobotics-darknet_ros
aruco_opencv_msgs github-fictionlab-aruco_opencv
clober_simulation github-CLOBOT-Co-Ltd-clober
clober_tools github-CLOBOT-Co-Ltd-clober
clpe_ros github-canlab-co-clpe_ros
bosch_locator_bridge github-boschglobal-locator_ros_bridge
radar_msgs github-ros-perception-radar_msgs
massrobotics_amr_sender github-inorbit-ai-ros_amr_interop
ros_ign_bridge github-ignitionrobotics-ros_ign
adi_tmc_coe github-analogdevicesinc-adi_tmc_coe
adi_tmcl github-analogdevicesinc-tmcl_ros
astra_ros github-semio-ai-astra_ros
beluga_ros github-Ekumen-OS-beluga
clearpath_configuration_msgs github-clearpathrobotics-clearpath_msgs
clearpath_control_msgs github-clearpathrobotics-clearpath_msgs
clearpath_dock_msgs github-clearpathrobotics-clearpath_msgs
clearpath_localization_msgs github-clearpathrobotics-clearpath_msgs
clearpath_logger_msgs github-clearpathrobotics-clearpath_msgs
clearpath_navigation_msgs github-clearpathrobotics-clearpath_msgs
clearpath_safety_msgs github-clearpathrobotics-clearpath_msgs
clearpath_onav_api_examples_lib github-cpr-application-clearpath_onav_examples
magnetometer_compass github-ctu-vras-compass
cras_relative_positional_controller github-ctu-vras-cras_relative_positional_controller
ergodic_exploration github-bostoncleek-ergodic_exploration
ess_imu_driver github-cubicleguy-ess_imu_driver
etsi_its_msgs_utils github-ika-rwth-aachen-etsi_its_messages
fields2cover_ros github-Fields2Cover-fields2cover_ros
flatland_msgs github-avidbots-flatland
flatland_server github-avidbots-flatland
gmcl github-adler-1994-gmcl
gnss_info_msgs github-ctu-vras-gnss-info
gnsstk_ros github-ctu-vras-gnss-info
gpp_interface github-dorezyuk-gpp
hri_actions_msgs github-ros4hri-hri_actions_msgs
iotbot github-EduArt-Robotik-iotbot
leo_example_follow_ar_tag github-LeoRover-leo_examples
leo_example_line_follower github-LeoRover-leo_examples
line_planner github-MoffKalast-line_planner
marine_acoustic_msgs github-apl-ocean-engineering-marine_msgs
message_tf_frame_transformer github-ika-rwth-aachen-message_tf_frame_transformer
mitch_v2_driver github-221eROS-mitch_v2_driver
moveit_task_constructor_core github-ros-planning-moveit_task_constructor
rviz_marker_tools github-ros-planning-moveit_task_constructor
mrpt_libros_bridge github-MRPT-mrpt_ros
muse_v2_driver github-221eROS-muse_v2_driver
py_binding_tools github-ros-planning-py_binding_tools
pyhri github-ros4hri-pyhri
quori_arm_controller github-Quori-ROS-quori_ros
quori_face github-Quori-ROS-quori_ros
quori_holonomic_drive_controller github-Quori-ROS-quori_ros
quori_mapping_odometry github-Quori-ROS-quori_ros
raspimouse_control github-rt-net-raspimouse
rm_common github-rm-controls-rm_control
rm_msgs github-rm-controls-rm_control
rose2 github-aislabunimi-ROSE2
serl_franka_controllers github-rail-berkeley-serl_franka_controllers
sick_scan_xd github-SICKAG-sick_scan_xd
thunder_line_follower_pmr3100 github-ThundeRatz-thunder_line_follower_pmr3100
turtlebot3_autorace_detect github-ROBOTIS-GIT-turtlebot3_autorace_2020
turtlebot3_autorace_driving github-ROBOTIS-GIT-turtlebot3_autorace_2020
vizanti github-MoffKalast-vizanti
xsens_mti_driver github-nobleo-xsens_mti_driver

Recent questions tagged geometry_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 Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

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

Changelog for package geometry_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Michel Hidalgo, Shane Loretz

1.12.7 (2018-11-06)

  • Add deprecation comment about Pose2D (#130) It started as unused and still isn\'t recommended. Followup to #129
  • Contributors: Tully Foote

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

  • Fix spelling mistakes
  • Contributors: trorornmn

1.12.4 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.12.3 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.12.2 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Contributors: Tully Foote

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)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

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)

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

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • 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
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they\'ve been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it\'s deprecated.
  • 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.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector \'using\' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to \'data\' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • 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
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn\'t stand on it\'s own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

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 Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
ar_track_alvar_msgs github-ros-perception-ar_track_alvar
arbotix_python github-vanadiumlabs-arbotix_ros
asr_msgs github-asr-ros-asr_msgs
automotive_navigation_msgs github-astuff-automotive_autonomy_msgs
auv_msgs github-oceansystemslab-auv_msgs
axis_camera github-ros-drivers-axis_camera
calibration_msgs github-ros-perception-calibration
image_cb_detector github-ros-perception-calibration
interval_intersection github-ros-perception-calibration
capabilities github-osrf-capabilities
cartesian_msgs github-davetcoleman-cartesian_msgs
cartographer_ros github-googlecartographer-cartographer_ros
cartographer_ros_msgs github-googlecartographer-cartographer_ros
common_msgs github-ros-common_msgs
nav_msgs github-ros-common_msgs
sensor_msgs github-ros-common_msgs
shape_msgs github-ros-common_msgs
trajectory_msgs github-ros-common_msgs
visualization_msgs github-ros-common_msgs
turtle_actionlib github-ros-common_tutorials
control_msgs github-ros-controls-control_msgs
costmap_converter github-rst-tu-dortmund-costmap_converter
ensenso_camera github-ensenso-ros_driver
ensenso_camera_msgs github-ensenso-ros_driver
fawkes_msgs github-fawkesrobotics-fawkes_msgs
flexbe_states github-team-vigir-flexbe_behavior_engine
frame_editor github-ipa320-rqt_frame_editor_plugin
franka_control github-frankaemika-franka_ros
franka_example_controllers github-frankaemika-franka_ros
gazebo_msgs github-ros-simulation-gazebo_ros_pkgs
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
generic_control_toolbox github-diogoalmeida-generic_control_toolbox
geodesy github-ros-geographic-info-geographic_info
geographic_msgs github-ros-geographic-info-geographic_info
eigen_conversions github-ros-geometry
kdl_conversions github-ros-geometry
tf github-ros-geometry
tf_conversions github-ros-geometry
tf2 github-ros-geometry2
tf2_bullet github-ros-geometry2
tf2_eigen github-ros-geometry2
tf2_geometry_msgs github-ros-geometry2
tf2_msgs github-ros-geometry2
tf2_ros github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
turtle_tf github-ros-geometry_tutorials
turtle_tf2 github-ros-geometry_tutorials
graph_msgs github-davetcoleman-graph_msgs
grid_map_demos github-anybotics-grid_map
grid_map_msgs github-anybotics-grid_map
grid_map_ros github-anybotics-grid_map
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
ibeo_lux github-astuff-ibeo_lux
image_rotate github-ros-perception-image_pipeline
imu_processors github-ros-perception-imu_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_filter_madgwick github-ccny-ros-pkg-imu_tools
spacenav_node github-ros-drivers-joystick_drivers
wiimote github-ros-drivers-joystick_drivers
respeaker_ros github-jsk-ros-pkg-jsk_3rdparty
jsk_footstep_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_gui_msgs github-jsk-ros-pkg-jsk_common_msgs
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
roseus github-jsk-ros-pkg-jsk_roseus
lgsvl_msgs github-lgsvl-lgsvl_msgs
explore_lite github-hrnr-m-explore
multirobot_map_merge github-hrnr-m-explore
swri_image_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
marti_nav_msgs github-swri-robotics-marti_messages
marti_sensor_msgs github-swri-robotics-marti_messages
marti_visualization_msgs github-swri-robotics-marti_messages
mav_msgs github-ethz-asl-mav_comm
mav_planning_msgs github-ethz-asl-mav_comm
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
mavros_msgs github-mavlink-mavros
test_mavros github-mavlink-mavros
mcl_3dl github-at-wat-mcl_3dl
mir_actions github-dfki-ric-mir_robot
mir_driver github-dfki-ric-mir_robot
mir_dwb_critics github-dfki-ric-mir_robot
mir_msgs github-dfki-ric-mir_robot
mbf_abstract_core github-magazino-move_base_flex
mbf_abstract_nav github-magazino-move_base_flex
mbf_costmap_core github-magazino-move_base_flex
mbf_costmap_nav github-magazino-move_base_flex
mbf_msgs github-magazino-move_base_flex
mbf_simple_nav github-magazino-move_base_flex
mbf_utility github-magazino-move_base_flex
moveit_commander github-ros-planning-moveit
moveit_core github-ros-planning-moveit
moveit_msgs github-ros-planning-moveit_msgs
moveit_python github-mikeferguson-moveit_python
moveit_visual_tools github-ros-planning-moveit_visual_tools
mrpt_graphslam_2d github-mrpt-ros-pkg-mrpt_slam
mvsim github-ual-arm-ros-pkg-mvsim
base_local_planner github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
global_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
nav_core github-ros-planning-navigation
navfn github-ros-planning-navigation
robot_pose_ekf github-ros-planning-navigation
nav2d_exploration github-skasperski-navigation_2d
nav2d_karto github-skasperski-navigation_2d
nav2d_localizer github-skasperski-navigation_2d
nav2d_msgs github-skasperski-navigation_2d
nav2d_navigator github-skasperski-navigation_2d
assisted_teleop github-ros-planning-navigation_experimental
pose_base_controller github-ros-planning-navigation_experimental
sbpl_lattice_planner github-ros-planning-navigation_experimental
twist_recovery github-ros-planning-navigation_experimental
move_base_msgs github-ros-planning-navigation_msgs
costmap_cspace github-at-wat-neonavigation
joystick_interrupt github-at-wat-neonavigation
map_organizer github-at-wat-neonavigation
obj_to_pointcloud github-at-wat-neonavigation
planner_cspace github-at-wat-neonavigation
safety_limiter github-at-wat-neonavigation
track_odometry github-at-wat-neonavigation
trajectory_tracker github-at-wat-neonavigation
costmap_cspace_msgs github-at-wat-neonavigation_msgs
planner_cspace_msgs github-at-wat-neonavigation_msgs
trajectory_tracker_msgs github-at-wat-neonavigation_msgs
novatel_msgs github-ros-drivers-novatel_span_driver
object_recognition_msgs github-wg-perception-object_recognition_msgs
octomap_msgs github-OctoMap-octomap_msgs
octomap_pa_msgs github-TUC-ProAut-ros_octomap
osm_cartography github-ros-geographic-info-open_street_map
route_network github-ros-geographic-info-open_street_map
face_detector github-wg-perception-people
leg_detector github-wg-perception-people
people_msgs github-wg-perception-people
people_tracking_filter github-wg-perception-people
people_velocity_tracker github-wg-perception-people
phidgets_ik github-ros-drivers-phidgets_drivers
pr2_teleop github-pr2-pr2_apps
pr2_teleop_general github-pr2-pr2_apps
pr2_msgs github-pr2-pr2_common
pr2_arm_move_ik github-pr2-pr2_common_actions
pr2_common_action_msgs github-pr2-pr2_common_actions
pr2_controllers_msgs github-pr2-pr2_controllers
pr2_head_action github-pr2-pr2_controllers
pr2_mechanism_controllers github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
fingertip_pressure github-pr2-pr2_ethercat_drivers
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_hardware_interface github-pr2-pr2_mechanism
pr2_gazebo github-PR2-pr2_simulator
pr2_gazebo_plugins github-PR2-pr2_simulator
rc_cloud_accumulator github-roboception-rc_cloud_accumulator
rc_hand_eye_calibration_client github-roboception-rc_visard_ros
rc_pick_client github-roboception-rc_visard_ros
rc_silhouettematch_client github-roboception-rc_visard_ros
rc_tagdetect_client github-roboception-rc_visard_ros
rc_visard_driver github-roboception-rc_visard_ros
robot_localization github-cra-ros-pkg-robot_localization
dlux_global_planner github-locusrobotics-robot_navigation
dwb_critics github-locusrobotics-robot_navigation
dwb_local_planner github-locusrobotics-robot_navigation
dwb_msgs github-locusrobotics-robot_navigation
locomotor github-locusrobotics-robot_navigation
nav_2d_msgs github-locusrobotics-robot_navigation
nav_2d_utils github-locusrobotics-robot_navigation
nav_core_adapter github-locusrobotics-robot_navigation
nav_grid_pub_sub github-locusrobotics-robot_navigation
ackermann_steering_controller github-ros-controls-ros_controllers
force_torque_sensor_controller github-ros-controls-ros_controllers
turtlesim github-ros-ros_tutorials
roscompile github-DLu-roscompile
cl_transforms_stamped github-ros-roslisp_common
rosserial_windows github-ros-drivers-rosserial
rqt_bag_plugins github-ros-visualization-rqt_bag
rqt_ez_publisher github-OTL-rqt_ez_publisher
rqt_image_view github-ros-visualization-rqt_image_view
rqt_nav_view github-ros-visualization-rqt_nav_view
rqt_pose_view github-ros-visualization-rqt_pose_view
rqt_robot_steering github-ros-visualization-rqt_robot_steering
rtabmap_ros github-introlab-rtabmap_ros
rviz github-ros-visualization-rviz
rviz_visual_tools github-davetcoleman-rviz_visual_tools
sbg_driver github-SBG-Systems-sbg_ros_driver
sick_ldmrs_msgs github-SICKAG-sick_ldmrs_laser
stage_ros github-ros-simulation-stage_ros
static_tf github-DLu-static_tf
teb_local_planner github-rst-tu-dortmund-teb_local_planner
key_teleop github-ros-teleop-teleop_tools
mouse_teleop github-ros-teleop-teleop_tools
teleop_twist_keyboard github-ros-teleop-teleop_twist_keyboard
tf2_web_republisher github-RobotWebTools-tf2_web_republisher
uuv_assistants github-uuvsimulator-uuv_simulator
uuv_auv_control_allocator github-uuvsimulator-uuv_simulator
uuv_control_cascaded_pid github-uuvsimulator-uuv_simulator
uuv_control_msgs github-uuvsimulator-uuv_simulator
uuv_control_utils github-uuvsimulator-uuv_simulator
uuv_thruster_manager github-uuvsimulator-uuv_simulator
uuv_trajectory_control github-uuvsimulator-uuv_simulator
uuv_gazebo_ros_plugins github-uuvsimulator-uuv_simulator
uuv_gazebo_ros_plugins_msgs github-uuvsimulator-uuv_simulator
uuv_sensor_ros_plugins github-uuvsimulator-uuv_simulator
uuv_sensor_ros_plugins_msgs github-uuvsimulator-uuv_simulator
uuv_teleop github-uuvsimulator-uuv_simulator
uuv_world_ros_plugins github-uuvsimulator-uuv_simulator
uuv_world_ros_plugins_msgs github-uuvsimulator-uuv_simulator
variant_topic_tools github-anybotics-variant
view_controller_msgs github-ros-visualization-view_controller_msgs
vision_msgs github-Kukanani-vision_msgs
visp_auto_tracker github-lagadic-vision_visp
visp_bridge github-lagadic-vision_visp
visp_camera_calibration github-lagadic-vision_visp
visp_hand2eye_calibration github-lagadic-vision_visp
visp_tracker github-lagadic-vision_visp
volksbot_driver github-uos-volksbot_driver
vrpn_client_ros github-ros-drivers-vrpn_client_ros
warehouse_ros github-ros-planning-warehouse_ros
wifi_ddwrt github-ros-drivers-wifi_ddwrt
easy_markers github-DLu-wu_ros_tools
xpp_msgs github-leggedrobotics-xpp
xsens_driver github-ethz-asl-ethzasl_xsens_driver
ypspur_ros github-openspur-ypspur_ros
ca_driver github-AutonomyLab-create_autonomy
dynpick_driver github-tork-a-dynpick_driver
ensenso github-crigroup-ensenso
innok_heros_driver github-innokrobotics-innok_heros_driver
katana github-uos-katana_driver
nav_pcontroller github-code-iai-nav_pcontroller
rosaria github-amor-ros-pkg-rosaria
rtt_geometry_msgs github-orocos-rtt_ros_integration

Recent questions tagged geometry_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 Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Michel Hidalgo

Authors

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

Changelog for package geometry_msgs

1.12.8 (2021-01-12)

  • Update package maintainers (#170)
  • Bump CMake version to avoid CMP0048 warning (#158)
  • Contributors: Michel Hidalgo, Shane Loretz

1.12.7 (2018-11-06)

  • Add deprecation comment about Pose2D (#130) It started as unused and still isn\'t recommended. Followup to #129
  • Contributors: Tully Foote

1.12.6 (2018-05-03)

1.12.5 (2016-09-30)

  • Fix spelling mistakes
  • Contributors: trorornmn

1.12.4 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.12.3 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.12.2 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

1.12.1 (2015-03-17)

  • updating outdated urls. fixes #52.
  • Contributors: Tully Foote

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)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

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)

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

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • 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
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they\'ve been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it\'s deprecated.
  • 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.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector \'using\' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to \'data\' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • 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
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn\'t stand on it\'s own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

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 Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
arbotix_python github-vanadiumlabs-arbotix_ros
aruco_msgs github-pal-robotics-aruco_ros
aruco_ros github-pal-robotics-aruco_ros
asr_msgs github-asr-ros-asr_msgs
auv_msgs github-oceansystemslab-auv_msgs
calibration_msgs github-ros-perception-calibration
image_cb_detector github-ros-perception-calibration
interval_intersection github-ros-perception-calibration
cartesian_msgs github-davetcoleman-cartesian_msgs
common_msgs github-ros-common_msgs
nav_msgs github-ros-common_msgs
sensor_msgs github-ros-common_msgs
shape_msgs github-ros-common_msgs
trajectory_msgs github-ros-common_msgs
visualization_msgs github-ros-common_msgs
turtle_actionlib github-ros-common_tutorials
control_msgs github-ros-controls-control_msgs
costmap_converter github-rst-tu-dortmund-costmap_converter
fetch_gazebo github-fetchrobotics-fetch_gazebo
fetch_teleop github-fetchrobotics-fetch_ros
gazebo_msgs github-ros-simulation-gazebo_ros_pkgs
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
geodesy github-ros-geographic-info-geographic_info
geographic_msgs github-ros-geographic-info-geographic_info
eigen_conversions github-ros-geometry
kdl_conversions github-ros-geometry
tf github-ros-geometry
tf_conversions github-ros-geometry
tf2 github-ros-geometry2
tf2_bullet github-ros-geometry2
tf2_eigen github-ros-geometry2
tf2_geometry_msgs github-ros-geometry2
tf2_msgs github-ros-geometry2
tf2_ros github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
turtle_tf github-ros-geometry_tutorials
turtle_tf2 github-ros-geometry_tutorials
graft github-ros-perception-graft
graph_msgs github-davetcoleman-graph_msgs
grid_map_demos github-ethz-asl-grid_map
grid_map_msgs github-ethz-asl-grid_map
grid_map_ros github-ethz-asl-grid_map
haf_grasping github-davidfischinger-haf_grasping
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
message_to_tf github-tu-darmstadt-ros-pkg-hector_localization
hector_compressed_map_transport github-tu-darmstadt-ros-pkg-hector_slam
hector_imu_tools github-tu-darmstadt-ros-pkg-hector_slam
hector_nav_msgs github-tu-darmstadt-ros-pkg-hector_slam
image_rotate github-ros-perception-image_pipeline
imu_processors github-ros-perception-imu_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_filter_madgwick github-ccny-ros-pkg-imu_tools
spacenav_node github-ros-drivers-joystick_drivers
wiimote github-ros-drivers-joystick_drivers
respeaker_ros github-jsk-ros-pkg-jsk_3rdparty
dynamic_tf_publisher github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
jsk_topic_tools github-jsk-ros-pkg-jsk_common
virtual_force_publisher github-jsk-ros-pkg-jsk_common
jsk_footstep_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_gui_msgs github-jsk-ros-pkg-jsk_common_msgs
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
cmd_vel_smoother github-jsk-ros-pkg-jsk_control
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
audio_to_spectrogram github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_msgs github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
roseus github-jsk-ros-pkg-jsk_roseus
jsk_interactive github-jsk-ros-pkg-jsk_visualization
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
leap_motion github-ros-drivers-leap_motion
explore_lite github-hrnr-m-explore
multirobot_map_merge github-hrnr-m-explore
marker_msgs github-tuw-robotics-marker_msgs
swri_image_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
marti_nav_msgs github-swri-robotics-marti_messages
marti_sensor_msgs github-swri-robotics-marti_messages
marti_visualization_msgs github-swri-robotics-marti_messages
mav_msgs github-ethz-asl-mav_comm
mav_planning_msgs github-ethz-asl-mav_comm
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
mavros_msgs github-mavlink-mavros
test_mavros github-mavlink-mavros
md49_base_controller github-Scheik-md49_base_controller
mongodb_store github-strands-project-mongodb_store
moveit_commander github-ros-planning-moveit
moveit_core github-ros-planning-moveit
moveit_experimental github-ros-planning-moveit
moveit_msgs github-ros-planning-moveit_msgs
moveit_python github-mikeferguson-moveit_python
moveit_visual_tools github-davetcoleman-moveit_visual_tools
mrpt_graphslam_2d github-mrpt-ros-pkg-mrpt_slam
mvsim github-ual-arm-ros-pkg-mvsim
naoqi_bridge_msgs github-ros-naoqi-naoqi_bridge_msgs
naoqi_driver github-ros-naoqi-naoqi_driver
base_local_planner github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
global_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
nav_core github-ros-planning-navigation
navfn github-ros-planning-navigation
robot_pose_ekf github-ros-planning-navigation
nav2d_exploration github-skasperski-navigation_2d
nav2d_karto github-skasperski-navigation_2d
nav2d_localizer github-skasperski-navigation_2d
nav2d_msgs github-skasperski-navigation_2d
nav2d_navigator github-skasperski-navigation_2d
range_sensor_layer github-DLu-navigation_layers
social_navigation_layers github-DLu-navigation_layers
move_base_msgs github-ros-planning-navigation_msgs
robot_setup_tf_tutorial github-ros-planning-navigation_tutorials
nmea_navsat_driver github-ros-drivers-nmea_navsat_driver
novatel_msgs github-ros-drivers-novatel_span_driver
object_recognition_msgs github-wg-perception-object_recognition_msgs
octomap_msgs github-OctoMap-octomap_msgs
face_detector github-wg-perception-people
leg_detector github-wg-perception-people
people_msgs github-wg-perception-people
people_tracking_filter github-wg-perception-people
people_velocity_tracker github-wg-perception-people
dummy_slam_broadcaster github-dillenberger-pepperl_fuchs
pose_cov_ops github-mrpt-ros-pkg-pose_cov_ops
pr2_msgs github-pr2-pr2_common
pr2_controllers_msgs github-pr2-pr2_controllers
pr2_head_action github-pr2-pr2_controllers
pr2_mechanism_controllers github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_hardware_interface github-pr2-pr2_mechanism
robot_calibration github-mikeferguson-robot_calibration
robot_calibration_msgs github-mikeferguson-robot_calibration
robot_controllers github-fetchrobotics-robot_controllers
robot_localization github-cra-ros-pkg-robot_localization
force_torque_sensor_controller github-ros-controls-ros_controllers
ros_numpy github-eric-wieser-ros_numpy
turtlesim github-ros-ros_tutorials
cl_transforms_stamped github-ros-roslisp_common
rospilot github-rospilot-rospilot
rosserial_windows github-ros-drivers-rosserial
rotors_comm github-ethz-asl-rotors_simulator
rotors_control github-ethz-asl-rotors_simulator
rotors_gazebo github-ethz-asl-rotors_simulator
rotors_gazebo_plugins github-ethz-asl-rotors_simulator
rotors_hil_interface github-ethz-asl-rotors_simulator
rotors_joy_interface github-ethz-asl-rotors_simulator
rqt_bag_plugins github-ros-visualization-rqt_bag
rqt_ez_publisher github-OTL-rqt_ez_publisher
rqt_image_view github-ros-visualization-rqt_image_view
rqt_nav_view github-ros-visualization-rqt_nav_view
rqt_pose_view github-ros-visualization-rqt_pose_view
rqt_robot_steering github-ros-visualization-rqt_robot_steering
rtabmap_ros github-introlab-rtabmap_ros
hrpsys_ros_bridge github-start-jsk-rtmros_common
rviz github-ros-visualization-rviz
rviz_visual_tools github-davetcoleman-rviz_visual_tools
laser_ortho_projector github-ccny-ros-pkg-scan_tools
laser_scan_matcher github-ccny-ros-pkg-scan_tools
polar_scan_matcher github-ccny-ros-pkg-scan_tools
sick_ldmrs_msgs github-SICKAG-sick_ldmrs_laser
teb_local_planner github-rst-tu-dortmund-teb_local_planner
key_teleop github-ros-teleop-teleop_tools
mouse_teleop github-ros-teleop-teleop_tools
teleop_twist_joy github-ros-teleop-teleop_twist_joy
teleop_twist_keyboard github-ros-teleop-teleop_twist_keyboard
tf2_web_republisher github-RobotWebTools-tf2_web_republisher
twist_mux github-ros-teleop-twist_mux
underwater_vehicle_dynamics github-uji-ros-pkg-underwater_simulation
uwsim github-uji-ros-pkg-underwater_simulation
acc_finder github-uos-uos_tools
uos_diffdrive_teleop github-uos-uos_tools
uos_freespace github-uos-uos_tools
variant_topic_tools github-ethz-asl-variant
view_controller_msgs github-ros-visualization-view_controller_msgs
visp_auto_tracker github-lagadic-vision_visp
visp_bridge github-lagadic-vision_visp
visp_camera_calibration github-lagadic-vision_visp
visp_hand2eye_calibration github-lagadic-vision_visp
visp_tracker github-lagadic-vision_visp
visp_ros github-lagadic-visp_ros
osg_utils github-uji-ros-pkg-visualization_osg
rwt_plot github-tork-a-visualization_rwt
volksbot_driver github-uos-volksbot_driver
vrpn_client_ros github-clearpathrobotics-vrpn_client_ros
warehouse_ros github-ros-planning-warehouse_ros
easy_markers github-DLu-wu_ros_tools
xsens_driver github-ethz-asl-ethzasl_xsens_driver
ca_driver github-AutonomyLab-create_autonomy
diffdrive_gazebo_plugin github-uos-diffdrive_gazebo_plugin
dynpick_driver github-tork-a-dynpick_driver
ecto_ros github-plasmodic-ecto_ros
force_torque_sensor_calib github-kth-ros-pkg-force_torque_tools
gravity_compensation github-kth-ros-pkg-force_torque_tools
frontier_exploration github-paulbovbel-frontier_exploration
geonav_transform github-bsb808-geonav_transform
grizzly_motion github-g-grizzly
grizzly_teleop github-g-grizzly
hector_costmap github-tu-darmstadt-ros-pkg-hector_navigation
hector_elevation_mapping github-tu-darmstadt-ros-pkg-hector_navigation
hector_elevation_msgs github-tu-darmstadt-ros-pkg-hector_navigation
hector_exploration_planner github-tu-darmstadt-ros-pkg-hector_navigation
hector_gps_calibration github-tu-darmstadt-ros-pkg-hector_navigation
hector_quadrotor_controller github-tu-darmstadt-ros-pkg-hector_quadrotor
hector_quadrotor_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_quadrotor
hector_quadrotor_model github-tu-darmstadt-ros-pkg-hector_quadrotor
hector_quadrotor_teleop github-tu-darmstadt-ros-pkg-hector_quadrotor
hector_barrel_detection_nodelet github-tu-darmstadt-ros-pkg-hector_visualization
hector_rviz_plugins github-tu-darmstadt-ros-pkg-hector_visualization
hector_stair_detection github-tu-darmstadt-ros-pkg-hector_visualization
hector_stair_detection_msgs github-tu-darmstadt-ros-pkg-hector_visualization
hector_worldmodel_msgs github-tu-darmstadt-ros-pkg-hector_worldmodel
household_objects_database_msgs github-ros-interactive-manipulation-household_objects_database_msgs
humanoid_nav_msgs github-ahornung-humanoid_msgs
innok_heros_driver github-innokrobotics-innok_heros_driver
katana github-uos-katana_driver
leptrino_force_torque github-hiveground-ros-package-leptrino_force_torque
manipulation_msgs github-ros-interactive-manipulation-manipulation_msgs
nao_interaction_msgs github-ros-naoqi-naoqi_interaction
nao_vision github-ros-naoqi-naoqi_interaction
nao_apps github-ros-naoqi-nao_robot
naoqi_driver_py github-ros-naoqi-naoqi_bridge
naoqi_navigation github-ros-naoqi-naoqi_bridge
naoqi_dcm_driver github-ros-naoqi-naoqi_dcm_driver
nav_pcontroller github-code-iai-nav_pcontroller
netft_utils github-UTNuclearRoboticsPublic-netft_utils
pioneer_bringup github-amineHorseman-pioneer_bringup
pioneer_teleop github-amineHorseman-pioneer_teleop
rcll_fawkes_sim github-timn-ros-rcll_fawkes_sim
rcll_fawkes_sim_msgs github-timn-ros-rcll_fawkes_sim_msgs
rcll_ros_msgs github-timn-ros-rcll_ros_msgs
robot_pose_publisher github-GT-RAIL-robot_pose_publisher
rosaria github-amor-ros-pkg-rosaria
rsv_balance_gazebo github-robosavvy-rsv_balance_simulator
rtt_geometry_msgs github-orocos-rtt_ros_integration
stdr_msgs github-stdr-simulator-ros-pkg-stdr_simulator
stdr_robot github-stdr-simulator-ros-pkg-stdr_simulator
stdr_samples github-stdr-simulator-ros-pkg-stdr_simulator
vigir_feet_pose_generator github-team-vigir-vigir_footstep_planning_core
vigir_foot_pose_transformer github-team-vigir-vigir_footstep_planning_core
vigir_pattern_generator github-team-vigir-vigir_footstep_planning_core
vigir_walk_monitor github-team-vigir-vigir_footstep_planning_core
vigir_footstep_planning_msgs github-team-vigir-vigir_footstep_planning_msgs
head_pose_estimation github-OSUrobotics-ros-head-tracking
data_vis_msgs github-code-iai-iai_common_msgs
designator_integration_msgs github-code-iai-iai_common_msgs
iai_control_msgs github-code-iai-iai_common_msgs
iai_kinematics_msgs github-code-iai-iai_common_msgs
iai_pepper_demo_msgs github-code-iai-iai_common_msgs
person_msgs github-code-iai-iai_common_msgs
nao_path_follower github-ros-naoqi-nao_extras
pocketsphinx github-mikeferguson-pocketsphinx
rosh_geometry github-OSUrobotics-rosh_robot_plugins
stereo_slam github-srv-stereo_slam
vicon_bridge github-ethz-asl-vicon_bridge
contact_handler github-lagadic-vrep_ros_bridge
drawing_handler github-lagadic-vrep_ros_bridge
force_sensor_handler github-lagadic-vrep_ros_bridge
quadrotor_handler github-lagadic-vrep_ros_bridge
rigid_body_handler github-lagadic-vrep_ros_bridge
ar_track_alvar_msgs github-sniekum-ar_track_alvar_msgs
aubo_kinematics github-auboliuxin-aubo_robot
aubo_new_driver github-auboliuxin-aubo_robot
freefloating_gazebo github-freefloating-gazebo-freefloating_gazebo
rail_ceiling github-GT-RAIL-rail_ceiling
graspdb github-GT-RAIL-rail_pick_and_place
rail_grasp_collection github-GT-RAIL-rail_pick_and_place
rail_pick_and_place_msgs github-GT-RAIL-rail_pick_and_place
rail_recognition github-GT-RAIL-rail_pick_and_place
range_msgs github-robotics-upo-range_msgs
ros_ethernet_rmp github-GT-RAIL-ros_ethernet_rmp
worldlib github-GT-RAIL-spatial_temporal_learning
stream_manipulator_3d github-3DVision-Stack-stream-manipulator-3D
heatmap github-eybee-heatmap
microstrain_mips github-bsb808-microstrain_3dm_gx5_45

Recent questions tagged geometry_msgs at Robotics Stack Exchange

Package Summary

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

Repository Summary

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

Package Description

geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.

Additional Links

Maintainers

  • Tully Foote

Authors

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

Changelog for package geometry_msgs

1.11.10 (2018-05-03)

1.11.9 (2016-02-22)

  • clarify the definition of a Vector3
  • Contributors: Vincent Rabaud

1.11.8 (2015-04-20)

  • geometry_msgs/InertiaStamped uses geometry_msgs/Inertia.
  • Contributors: Gayane Kazhoyan, Georg Bartels

1.11.7 (2015-03-21)

  • Add Accel, AccelStamped, AccelWithCovariance, AccelWithCovarianceStamped message definitions
  • Add Inertia and InertiaStamped messages
  • Contributors: Jonathan Bohren, Paul Bovbel

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)

  • update email in package.xml

1.9.15 (2013-03-08)

1.9.14 (2013-01-19)

1.9.13 (2013-01-13)

  • fix spelling in comments (fix #3194)

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)

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

1.8.8 (2012-06-12 22:36)

  • removed obsolete catkin tag from manifest files
  • removed unnecessary package name from some messages
  • 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
  • install-related fixes
  • common_msgs: removing migration rules as all are over a year old
  • bye bye vestigial MSG_DIRS
  • geometry_msgs: getting rid of other build files
  • updated to new catkin_export_python macro
  • adios rosbuild2 in manifest.xml
  • catkin updates
  • catkin_project
  • Updated to work with new message generation macros
  • adios debian/ hello stack.yaml. (sketch/prototype/testing).
  • Getting standalone message generation working... w/o munging rosbuild2
  • rosbuild2 tweaks
  • initial updating for new light message generation and wgbuild
  • missing dependencies
  • updating bagmigration exports
  • rosbuild2 taking shape
  • workaround bug #ros3018 until ros-1.2.3 comes out
  • removing all the extra exports
  • Added Ubuntu platform tags to manifest
  • Remove use of deprecated rosbuild macros
  • link to tf package as per doc review
  • doc reviewed status
  • wrapping manifest nicely
  • updated url and description
  • full migration rules
  • switching TransformStamped logic to follow that of all other frame_ids where the frame_id is the operating frame and there is now a child_frame_id which defines the target frame. And the parent frame is gone. This is only changing the message. The API change will come later.
  • making covariance follow same convention as Pose
  • rotation representation was specified the wrong way in the message comment
  • Adding a stamped version of polygon
  • Adding comment to Polygon message
  • Adding migration rule from ParticleCloud to PoseArray
  • clearing API reviews for they\'ve been through a bunch of them recently.
  • comments on all msgs except Polygon
  • removing PoseWithRates as it\'s deprecated.
  • 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.
  • undo of #2270, (.data for stamped). reverts r21133
  • Adding migration rules to get migration tests to pass.
  • switching from PosewithRatesStamped to Odometry #2277
  • Fixing some of the migration rules associated with unrolling of the .data change.
  • PoseWithCovarianceStamped::data -> PoseWithCovarianceStamped::pose
  • Reverse r21134, PointStamped::point->PointStamped::data
  • reverse QuaternionStamped::quaternion -> QuaternionStamped::data change
  • undoing r21137, keeping Vector3Stamped as was, but keeping in fix to door_handle_detector \'using\' bug
  • Adding more migration rule tests and fixing assorted rules.
  • reverting r2118. Redoing #2275 #2274 to not go to \'data\' standard
  • #2271 Vector3Stamped uses new standarization
  • PointStamped::point -> PointStamped::data (#2276)
  • new Stamped format #2270
  • Changing migration rule for Twist to go to TwistStamped.
  • QuaternionStamped::quaternion -> QuaternionStamped::data (#2278)
  • #2274 #2275 updated to header/data
  • PoseWithCovariance->PoseWithCovarianceStamped PoseWithCovarianceStamped::pose_with_covariance -> PoseWithCovarianceStamped::data
  • 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
  • Moved robot_msgs/Polygon3D to geometry_msgs/Polygon for ticket #1310
  • moving PoseArray into geometry_msgs #1907
  • removing header for this is a type for composing and doesn\'t stand on it\'s own to be transformed etc.
  • adding TwistWithCovariance #2251
  • creating Wrench and WrenchStamped in geometry_msgs #1935
  • adding unused Pose2D message as per API review #2249
  • geometry_msgs: Documented that covariance uses fixed axis not euler angles.
  • merging in the changes to messages see ros-users email. THis is about half the common_msgs API changes

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 Repo Deps
ar_track_alvar github-ros-perception-ar_track_alvar
arbotix_python github-vanadiumlabs-arbotix_ros
aruco_msgs github-pal-robotics-aruco_ros
aruco_ros github-pal-robotics-aruco_ros
asr_flock_of_birds github-asr-ros-asr_flock_of_birds
asr_flock_of_birds_tracking github-asr-ros-asr_flock_of_birds_tracking
asr_mild_base_fake_driving github-asr-ros-asr_mild_base_fake_driving
asr_msgs github-asr-ros-asr_msgs
asr_navfn github-asr-ros-asr_navfn
asr_object_database github-asr-ros-asr_object_database
asr_robot_model_services github-asr-ros-asr_robot_model_services
ati_force_torque github-iirob-ati_force_torque
automotive_navigation_msgs github-astuff-automotive_autonomy_msgs
automotive_navigation_msgs github-astuff-platform_automation_msgs
auv_msgs github-oceansystemslab-auv_msgs
axis_camera github-clearpathrobotics-axis_camera
brics_actuator github-wnowak-brics_actuator
calibration_msgs github-ros-perception-calibration
image_cb_detector github-ros-perception-calibration
interval_intersection github-ros-perception-calibration
capabilities github-osrf-capabilities
cartesian_msgs github-davetcoleman-cartesian_msgs
cartographer_ros github-googlecartographer-cartographer_ros
cartographer_ros_msgs github-googlecartographer-cartographer_ros
cob_interactive_teleop github-ipa320-cob_command_tools
cob_script_server github-ipa320-cob_command_tools
cob_teleop github-ipa320-cob_command_tools
scenario_test_tools github-ipa320-cob_command_tools
cob_base_velocity_smoother github-ipa320-cob_control
cob_cartesian_controller github-ipa320-cob_control
cob_collision_velocity_filter github-ipa320-cob_control
cob_control_msgs github-ipa320-cob_control
cob_footprint_observer github-ipa320-cob_control
cob_frame_tracker github-ipa320-cob_control
cob_model_identifier github-ipa320-cob_control
cob_obstacle_distance github-ipa320-cob_control
cob_omni_drive_controller github-ipa320-cob_control
cob_twist_controller github-ipa320-cob_control
cob_undercarriage_ctrl github-ipa320-cob_driver
cob_grasp_generation github-ipa320-cob_manipulation
cob_kinematics github-ipa320-cob_manipulation
cob_lookat_action github-ipa320-cob_manipulation
cob_moveit_interface github-ipa320-cob_manipulation
cob_obstacle_distance_moveit github-ipa320-cob_manipulation
cob_pick_place_action github-ipa320-cob_manipulation
cob_linear_nav github-ipa320-cob_navigation
cob_map_accessibility_analysis github-ipa320-cob_navigation
cob_3d_mapping_msgs github-ipa320-cob_perception_common
cob_image_flip github-ipa320-cob_perception_common
cob_object_detection_msgs github-ipa320-cob_perception_common
cob_perception_msgs github-ipa320-cob_perception_common
cob_bringup_sim github-ipa320-cob_simulation
common_msgs github-ros-common_msgs
nav_msgs github-ros-common_msgs
sensor_msgs github-ros-common_msgs
shape_msgs github-ros-common_msgs
trajectory_msgs github-ros-common_msgs
visualization_msgs github-ros-common_msgs
turtle_actionlib github-ros-common_tutorials
control_msgs github-ros-controls-control_msgs
costmap_converter github-rst-tu-dortmund-costmap_converter
criutils github-crigroup-criutils
dataspeed_ulc_can bitbucket-DataspeedInc-dataspeed_ulc_ros
eband_local_planner github-utexas-bwi-eband_local_planner
fawkes_msgs github-fawkesrobotics-fawkes_msgs
fetch_gazebo github-fetchrobotics-fetch_gazebo
fetch_auto_dock_msgs github-fetchrobotics-fetch_msgs
fetch_driver_msgs github-fetchrobotics-fetch_msgs
fetch_teleop github-fetchrobotics-fetch_ros
fiducial_pose github-UbiquityRobotics-fiducials
flexbe_states github-team-vigir-flexbe_behavior_engine
frame_editor github-ipa320-rqt_frame_editor_plugin
gazebo_msgs github-ros-simulation-gazebo_ros_pkgs
gazebo_plugins github-ros-simulation-gazebo_ros_pkgs
gazebo_ros github-ros-simulation-gazebo_ros_pkgs
generic_control_toolbox github-diogoalmeida-generic_control_toolbox
geodesy github-ros-geographic-info-geographic_info
geographic_msgs github-ros-geographic-info-geographic_info
eigen_conversions github-ros-geometry
kdl_conversions github-ros-geometry
tf github-ros-geometry
tf_conversions github-ros-geometry
tf2 github-ros-geometry2
tf2_bullet github-ros-geometry2
tf2_eigen github-ros-geometry2
tf2_geometry_msgs github-ros-geometry2
tf2_msgs github-ros-geometry2
tf2_ros github-ros-geometry2
tf2_sensor_msgs github-ros-geometry2
turtle_tf github-ros-geometry_tutorials
turtle_tf2 github-ros-geometry_tutorials
graft github-ros-perception-graft
graph_msgs github-davetcoleman-graph_msgs
grid_map_demos github-anybotics-grid_map
grid_map_msgs github-anybotics-grid_map
grid_map_ros github-anybotics-grid_map
haf_grasping github-davidfischinger-haf_grasping
handeye github-crigroup-handeye
hector_gazebo_plugins github-tu-darmstadt-ros-pkg-hector_gazebo
hector_pose_estimation github-tu-darmstadt-ros-pkg-hector_localization
hector_pose_estimation_core github-tu-darmstadt-ros-pkg-hector_localization
message_to_tf github-tu-darmstadt-ros-pkg-hector_localization
hector_compressed_map_transport github-tu-darmstadt-ros-pkg-hector_slam
hector_imu_tools github-tu-darmstadt-ros-pkg-hector_slam
hector_nav_msgs github-tu-darmstadt-ros-pkg-hector_slam
ibeo_lux github-astuff-ibeo_lux
image_rotate github-ros-perception-image_pipeline
imu_processors github-ros-perception-imu_pipeline
imu_transformer github-ros-perception-imu_pipeline
imu_filter_madgwick github-ccny-ros-pkg-imu_tools
spacenav_node github-ros-drivers-joystick_drivers
wiimote github-ros-drivers-joystick_drivers
respeaker_ros github-jsk-ros-pkg-jsk_3rdparty
dynamic_tf_publisher github-jsk-ros-pkg-jsk_common
image_view2 github-jsk-ros-pkg-jsk_common
jsk_topic_tools github-jsk-ros-pkg-jsk_common
virtual_force_publisher github-jsk-ros-pkg-jsk_common
jsk_footstep_msgs github-jsk-ros-pkg-jsk_common_msgs
jsk_gui_msgs github-jsk-ros-pkg-jsk_common_msgs
posedetection_msgs github-jsk-ros-pkg-jsk_common_msgs
cmd_vel_smoother github-jsk-ros-pkg-jsk_control
jsk_footstep_controller github-jsk-ros-pkg-jsk_control
jsk_footstep_planner github-jsk-ros-pkg-jsk_control
audio_to_spectrogram github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros github-jsk-ros-pkg-jsk_recognition
jsk_pcl_ros_utils github-jsk-ros-pkg-jsk_recognition
jsk_perception github-jsk-ros-pkg-jsk_recognition
jsk_recognition_msgs github-jsk-ros-pkg-jsk_recognition
jsk_recognition_utils github-jsk-ros-pkg-jsk_recognition
roseus github-jsk-ros-pkg-jsk_roseus
jsk_interactive github-jsk-ros-pkg-jsk_visualization
jsk_interactive_marker github-jsk-ros-pkg-jsk_visualization
jsk_rviz_plugins github-jsk-ros-pkg-jsk_visualization
kobuki_auto_docking github-yujinrobot-kobuki
kobuki_keyop github-yujinrobot-kobuki
kobuki_node github-yujinrobot-kobuki
kobuki_random_walker github-yujinrobot-kobuki
kobuki_safety_controller github-yujinrobot-kobuki
kobuki_testsuite github-yujinrobot-kobuki
kobuki_gazebo_plugins github-yujinrobot-kobuki_desktop
kobuki_qtestsuite github-yujinrobot-kobuki_desktop
leap_motion github-ros-drivers-leap_motion
lgsvl_msgs github-lgsvl-lgsvl_msgs
marker_msgs github-tuw-robotics-marker_msgs
swri_image_util github-swri-robotics-marti_common
swri_transform_util github-swri-robotics-marti_common
marti_nav_msgs github-swri-robotics-marti_messages
marti_sensor_msgs github-swri-robotics-marti_messages
marti_visualization_msgs github-swri-robotics-marti_messages
mav_msgs github-ethz-asl-mav_comm
mav_planning_msgs github-ethz-asl-mav_comm
mavros github-mavlink-mavros
mavros_extras github-mavlink-mavros
mavros_msgs github-mavlink-mavros
test_mavros github-mavlink-mavros
mcl_3dl github-at-wat-mcl_3dl
md49_base_controller github-Scheik-md49_base_controller
microstrain_mips github-ros-drivers-microstrain_mips
mir_actions github-dfki-ric-mir_robot
mir_driver github-dfki-ric-mir_robot
mir_dwb_critics github-dfki-ric-mir_robot
mir_msgs github-dfki-ric-mir_robot
mongodb_store github-strands-project-mongodb_store
moveit_commander github-ros-planning-moveit
moveit_core github-ros-planning-moveit
moveit_experimental github-ros-planning-moveit
moveit_msgs github-ros-planning-moveit_msgs
moveit_python github-mikeferguson-moveit_python
moveit_visual_tools github-davetcoleman-moveit_visual_tools
mrpt_graphslam_2d github-mrpt-ros-pkg-mrpt_slam
mvsim github-ual-arm-ros-pkg-mvsim
naoqi_bridge_msgs github-ros-naoqi-naoqi_bridge_msgs
naoqi_driver github-ros-naoqi-naoqi_driver
base_local_planner github-ros-planning-navigation
costmap_2d github-ros-planning-navigation
fake_localization github-ros-planning-navigation
global_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_base_msgs github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
nav_core github-ros-planning-navigation
navfn github-ros-planning-navigation
robot_pose_ekf github-ros-planning-navigation
nav2d_exploration github-skasperski-navigation_2d
nav2d_karto github-skasperski-navigation_2d
nav2d_localizer github-skasperski-navigation_2d
nav2d_msgs github-skasperski-navigation_2d
nav2d_navigator github-skasperski-navigation_2d
assisted_teleop github-ros-planning-navigation_experimental
pose_base_controller github-ros-planning-navigation_experimental
sbpl_lattice_planner github-ros-planning-navigation_experimental
twist_recovery github-ros-planning-navigation_experimental
range_sensor_layer github-DLu-navigation_layers
social_navigation_layers github-DLu-navigation_layers
robot_setup_tf_tutorial github-ros-planning-navigation_tutorials
costmap_cspace github-at-wat-neonavigation
joystick_interrupt github-at-wat-neonavigation
map_organizer github-at-wat-neonavigation
obj_to_pointcloud github-at-wat-neonavigation
planner_cspace github-at-wat-neonavigation
safety_limiter github-at-wat-neonavigation
track_odometry github-at-wat-neonavigation
trajectory_tracker github-at-wat-neonavigation
costmap_cspace_msgs github-at-wat-neonavigation_msgs
trajectory_tracker_msgs github-at-wat-neonavigation_msgs
nmea_navsat_driver github-ros-drivers-nmea_navsat_driver
novatel_msgs github-ros-drivers-novatel_span_driver
object_recognition_msgs github-wg-perception-object_recognition_msgs
octomap_msgs github-OctoMap-octomap_msgs
octomap_pa github-TUC-ProAut-ros_octomap
osm_cartography github-ros-geographic-info-open_street_map
route_network github-ros-geographic-info-open_street_map
face_detector github-wg-perception-people
leg_detector github-wg-perception-people
people_msgs github-wg-perception-people
people_tracking_filter github-wg-perception-people
people_velocity_tracker github-wg-perception-people
dummy_slam_broadcaster github-dillenberger-pepperl_fuchs
phidgets_imu github-ros-drivers-phidgets_drivers
phidgets_ir github-ros-drivers-phidgets_drivers
pose_cov_ops github-mrpt-ros-pkg-pose_cov_ops
pr2_teleop github-pr2-pr2_apps
pr2_teleop_general github-pr2-pr2_apps
laser_joint_processor github-PR2-pr2_calibration
laser_joint_projector github-PR2-pr2_calibration
pr2_calibration_launch github-PR2-pr2_calibration
pr2_msgs github-pr2-pr2_common
pr2_arm_move_ik github-pr2-pr2_common_actions
pr2_common_action_msgs github-pr2-pr2_common_actions
pr2_controllers_msgs github-pr2-pr2_controllers
pr2_head_action github-pr2-pr2_controllers
pr2_mechanism_controllers github-pr2-pr2_controllers
robot_mechanism_controllers github-pr2-pr2_controllers
fingertip_pressure github-PR2-pr2_ethercat_drivers
pr2_arm_kinematics github-pr2-pr2_kinematics
pr2_hardware_interface github-pr2-pr2_mechanism
pr2_navigation_perception github-pr2-pr2_navigation
pr2_gazebo github-PR2-pr2_simulator
pr2_gazebo_plugins github-PR2-pr2_simulator
rc_cloud_accumulator github-roboception-rc_cloud_accumulator
rc_hand_eye_calibration_client github-roboception-rc_visard_ros
rc_pick_client github-roboception-rc_visard_ros
rc_silhouettematch_client github-roboception-rc_visard_ros
rc_tagdetect_client github-roboception-rc_visard_ros
rc_visard_driver github-roboception-rc_visard_ros
ridgeback_gazebo_plugins github-ridgeback-ridgeback_simulator
robot_calibration github-mikeferguson-robot_calibration
robot_calibration_msgs github-mikeferguson-robot_calibration
robot_controllers github-fetchrobotics-robot_controllers
robot_localization github-cra-ros-pkg-robot_localization
dlux_global_planner github-locusrobotics-robot_navigation
dwb_critics github-locusrobotics-robot_navigation
dwb_local_planner github-locusrobotics-robot_navigation
dwb_msgs github-locusrobotics-robot_navigation