期刊文献+
共找到2,090篇文章
< 1 2 105 >
每页显示 20 50 100
Approach of simultaneous localization and mapping based on local maps for robot 被引量:6
1
作者 陈白帆 蔡自兴 胡德文 《Journal of Central South University of Technology》 EI 2006年第6期713-716,共4页
An extended Kalman filter approach of simultaneous localization and mapping(SLAM) was proposed based on local maps. A local frame of reference was established periodically at the position of the robot, and then the ob... An extended Kalman filter approach of simultaneous localization and mapping(SLAM) was proposed based on local maps. A local frame of reference was established periodically at the position of the robot, and then the observations of the robot and landmarks were fused into the global frame of reference. Because of the independence of the local map, the approach does not cumulate the estimate and calculation errors which are produced by SLAM using Kalman filter directly. At the same time, it reduces the computational complexity. This method is proven correct and feasible in simulation experiments. 展开更多
关键词 simultaneous localization and mapping extended Kalman filter local map
下载PDF
基于Local-map的Mesh光网络简单p圈构造法
2
作者 赵太飞 虞红芳 李乐民 《光电工程》 EI CAS CSCD 北大核心 2006年第5期122-125,140,共5页
圈构造算法是Mesh光网络中p圈法设计的前提。根据简单p圈的特点,针对圈构造算法问题,提出将原来圈上边变为跨接边的圈扩展算法。该圈扩展算法构造的圈具有保护性能优良,并且包含所有原来的圈上的点。在圈扩展算法和Local-map概念的基础... 圈构造算法是Mesh光网络中p圈法设计的前提。根据简单p圈的特点,针对圈构造算法问题,提出将原来圈上边变为跨接边的圈扩展算法。该圈扩展算法构造的圈具有保护性能优良,并且包含所有原来的圈上的点。在圈扩展算法和Local-map概念的基础上提出了基于Local-map的p圈启发式算法,该算法在Local-map中运行圈扩展算法,这样既能提高p圈的保护性能,又能使p圈位于局域范围内,保证快速恢复。对比分析Local-map和DFS两种找圈算法的实验结果,该方案构造的圈恢复速度快,容量利用率高,比较适合网状光网络中的p圈设计。 展开更多
关键词 网状 光网络 P圈 局部图 圈构造
下载PDF
Research on simultaneous localization and mapping for AUV by an improved method:Variance reduction FastSLAM with simulated annealing 被引量:5
3
作者 Jiashan Cui Dongzhu Feng +1 位作者 Yunhui Li Qichen Tian 《Defence Technology(防务技术)》 SCIE EI CAS CSCD 2020年第3期651-661,共11页
At present,simultaneous localization and mapping(SLAM) for an autonomous underwater vehicle(AUV)is a research hotspot.Aiming at the problem of non-linear model and non-Gaussian noise in AUV motion,an improved method o... At present,simultaneous localization and mapping(SLAM) for an autonomous underwater vehicle(AUV)is a research hotspot.Aiming at the problem of non-linear model and non-Gaussian noise in AUV motion,an improved method of variance reduction fast simultaneous localization and mapping(FastSLAM) with simulated annealing is proposed to solve the problems of particle degradation,particle depletion and particle loss in traditional FastSLAM,which lead to the reduction of AUV location estimation accuracy.The adaptive exponential fading factor is generated by the anneal function of simulated annealing algorithm to improve the effective particle number and replace resampling.By increasing the weight of small particles and decreasing the weight of large particles,the variance of particle weight can be reduced,the number of effective particles can be increased,and the accuracy of AUV location and feature location estimation can be improved to some extent by retaining more information carried by particles.The experimental results based on trial data show that the proposed simulated annealing variance reduction FastSLAM method avoids particle degradation,maintains the diversity of particles,weakened the degeneracy and improves the accuracy and stability of AUV navigation and localization system. 展开更多
关键词 Autonomous underwater vehicle(AUV) SONAR Simultaneous localization and mapping(SLAM) Simulated annealing FASTSLAM
下载PDF
Robust Iterated Sigma Point FastSLAM Algorithm for Mobile Robot Simultaneous Localization and Mapping 被引量:2
4
作者 SONG Yu SONG Yongduan LI Qingling 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2011年第4期693-700,共8页
Simultaneous localization and mapping (SLAM) is a key technology for mobile robots operating under unknown environment. While FastSLAM algorithm is a popular solution to the SLAM problem, it suffers from two major d... Simultaneous localization and mapping (SLAM) is a key technology for mobile robots operating under unknown environment. While FastSLAM algorithm is a popular solution to the SLAM problem, it suffers from two major drawbacks: one is particle set degeneracy due to lack of observation information in proposal distribution design of the particle filter; the other is errors accumulation caused by linearization of the nonlinear robot motion model and the nonlinear environment observation model. For the purpose of overcoming the above problems, a new iterated sigma point FastSLAM (ISP-FastSLAM) algorithm is proposed. The main contribution of the algorithm lies in the utilization of iterated sigma point Kalman filter (ISPKF), which minimizes statistical linearization error through Gaussian-Newton iteration, to design an optimal proposal distribution of the particle filter and to estimate the environment landmarks. On the basis of Rao-Blackwellized particle filter, the proposed ISP-FastSLAM algorithm is comprised by two main parts: in the first part, an iterated sigma point particle filter (ISPPF) to localize the robot is proposed, in which the proposal distribution is accurately estimated by the ISPKF; in the second part, a set of ISPKFs is used to estimate the environment landmarks. The simulation test of the proposed ISP-FastSLAM algorithm compared with FastSLAM2.0 algorithm and Unscented FastSLAM algorithm is carried out, and the performances of the three algorithms are compared. The simulation and comparing results show that the proposed ISP-FastSLAM outperforms other two algorithms both in accuracy and in robustness. The proposed algorithm provides reference for the optimization research of FastSLAM algorithm. 展开更多
关键词 mobile robot simultaneous localization and mapping (SLAM) particle filter Kalman filter unscented transformation
下载PDF
A novel method for mobile robot simultaneous localization and mapping 被引量:4
5
作者 LI Mao-hai HONG Bing-rong +1 位作者 LUO Rong-hua WEI Zhen-hua 《Journal of Zhejiang University-Science A(Applied Physics & Engineering)》 SCIE EI CAS CSCD 2006年第6期937-944,共8页
A novel mobile robot simultaneous localization and mapping (SLAM) method is implemented by using the Rao- Blackwellized particle filter (RBPF) for monocular vision-based autonomous robot in unknown indoor environment.... A novel mobile robot simultaneous localization and mapping (SLAM) method is implemented by using the Rao- Blackwellized particle filter (RBPF) for monocular vision-based autonomous robot in unknown indoor environment. The particle filter combined with unscented Kalman filter (UKF) for extending the path posterior by sampling new poses integrating the current observation. Landmark position estimation and update is implemented through UKF. Furthermore, the number of resampling steps is determined adaptively, which greatly reduces the particle depletion problem. Monocular CCD camera mounted on the robot tracks the 3D natural point landmarks structured with matching image feature pairs extracted through Scale Invariant Feature Transform (SIFT). The matching for multi-dimension SIFT features which are highly distinctive due to a special descriptor is implemented with a KD-Tree. Experiments on the robot Pioneer3 showed that our method is very precise and stable. 展开更多
关键词 Mobile robot Rao-Blackwellized particle filter (RBPF) Monocular vision Simultaneous localization and mapping (SLAM)
下载PDF
Immune evolutionary algorithms with domain knowledge for simultaneous localization and mapping 被引量:4
6
作者 李枚毅 蔡自兴 《Journal of Central South University of Technology》 EI 2006年第5期529-535,共7页
Immune evolutionary algorithms with domain knowledge were presented to solve the problem of simultaneous localization and mapping for a mobile robot in unknown environments. Two operators with domain knowledge were de... Immune evolutionary algorithms with domain knowledge were presented to solve the problem of simultaneous localization and mapping for a mobile robot in unknown environments. Two operators with domain knowledge were designed in algorithms, where the feature of parallel line segments without the problem of data association was used to construct a vaccination operator, and the characters of convex vertices in polygonal obstacle were extended to develop a pulling operator of key point grid. The experimental results of a real mobile robot show that the computational expensiveness of algorithms designed is less than other evolutionary algorithms for simultaneous localization and mapping and the maps obtained are very accurate. Because immune evolutionary algorithms with domain knowledge have some advantages, the convergence rate of designed algorithms is about 44% higher than those of other algorithms. 展开更多
关键词 immune evolutionary algorithms simultaneous localization and mapping domain knowledge
下载PDF
Localization and mapping in urban area based on 3D point cloud of autonomous vehicles 被引量:2
7
作者 王美玲 李玉 +2 位作者 杨毅 朱昊 刘彤 《Journal of Beijing Institute of Technology》 EI CAS 2016年第4期473-482,共10页
In order to meet the application requirements of autonomous vehicles, this paper proposes a simultaneous localization and mapping (SLAM) algorithm, which uses a VoxelGrid filter to down sample the point cloud data, ... In order to meet the application requirements of autonomous vehicles, this paper proposes a simultaneous localization and mapping (SLAM) algorithm, which uses a VoxelGrid filter to down sample the point cloud data, with the combination of iterative closest points (ICP) algorithm and Gaussian model for particles updating, the matching between the local map and the global map to quantify particles' importance weight. The crude estimation by using ICP algorithm can find the high probability area of autonomous vehicles' poses, which would decrease particle numbers, increase algorithm speed and restrain particles' impoverishment. The calculation of particles' importance weight based on matching of attribute between grid maps is simple and practicable. Experiments carried out with the autonomous vehicle platform validate the effectiveness of our approaches. 展开更多
关键词 simultaneous localization and mapping (SLAM) Rao-Blackwellized particle filter RB-PF) VoxelGrid filter ICP algorithm Gaussian model urban area
下载PDF
A survey: which features are required for dynamic visual simultaneous localization and mapping? 被引量:2
8
作者 Zewen Xu Zheng Rong Yihong Wu 《Visual Computing for Industry,Biomedicine,and Art》 EI 2021年第1期183-198,共16页
In recent years,simultaneous localization and mapping in dynamic environments(dynamic SLAM)has attracted significant attention from both academia and industry.Some pioneering work on this technique has expanded the po... In recent years,simultaneous localization and mapping in dynamic environments(dynamic SLAM)has attracted significant attention from both academia and industry.Some pioneering work on this technique has expanded the potential of robotic applications.Compared to standard SLAM under the static world assumption,dynamic SLAM divides features into static and dynamic categories and leverages each type of feature properly.Therefore,dynamic SLAM can provide more robust localization for intelligent robots that operate in complex dynamic environments.Additionally,to meet the demands of some high-level tasks,dynamic SLAM can be integrated with multiple object tracking.This article presents a survey on dynamic SLAM from the perspective of feature choices.A discussion of the advantages and disadvantages of different visual features is provided in this article. 展开更多
关键词 Dynamic simultaneous localization and mapping Multiple objects tracking Data association Object simultaneous localization and mapping Feature choices
下载PDF
A MAP Approach for Vision-based Self-localization of Mobile Robot 被引量:3
9
作者 WANG Ke WANG Wei ZHUANG Yan 《自动化学报》 EI CSCD 北大核心 2008年第2期159-166,共8页
一当场,自我本地化系统为在有深入的 3D 里程碑的 3D 环境起作用的活动机器人被开发。机器人通过合并从 odometry 和单向性的照相机收集的信息的一个地图评估者递归地估计它的姿势。我们为这二个传感器造非线性的模型并且坚持说机器人... 一当场,自我本地化系统为在有深入的 3D 里程碑的 3D 环境起作用的活动机器人被开发。机器人通过合并从 odometry 和单向性的照相机收集的信息的一个地图评估者递归地估计它的姿势。我们为这二个传感器造非线性的模型并且坚持说机器人运动和不精密的传感器大小的无常操作应该全部被嵌入并且追踪我们的系统。我们在一个概率的几何学观点和使用 unscented 变换描述无常框架宣传无常,它经历给定的非线性的功能。就我们的机器人的处理力量而言,图象特征在相应投射特征的附近被提取。另外,数据协会被统计距离评估。最后,一系列系统的实验被进行证明我们的系统的可靠、精确的性能。 展开更多
关键词 map估计 自动定位 视觉 移动式遥控装置 不确定传播 传感器
下载PDF
Implementation and Evaluation of Local Dynamic Map in Safety Driving Systems 被引量:13
10
作者 Hideki Shimada Akihiro Yamaguchi +1 位作者 Hiroaki Takada Kenya Sato 《Journal of Transportation Technologies》 2015年第2期102-112,共11页
Cooperative safety driving systems using vehicle-to-vehicle and vehicle-to infrastructure communication are developed. Sensor data of vehicles and infrastructures are communicated in the cooperative safety driving sys... Cooperative safety driving systems using vehicle-to-vehicle and vehicle-to infrastructure communication are developed. Sensor data of vehicles and infrastructures are communicated in the cooperative safety driving system. LDM (Local Dynamic Map) is standardized by ETSI (European Telecommunications Standards Institute) to manage the vehicle sensor data and the map data. Implementations of LDM are reported on documents of ETSI, but there are no numerical results. The implementations of LDM are deployed the database management system. We think that the response time of the database becomes higher as the number of vehicles grows. In this paper, we have implemented and evaluated the LDM with the collision detection application. 展开更多
关键词 local DYNAMIC map ITS COOPERATIVE Safety Driving SYSTEMS
下载PDF
Rapid State Augmentation for Compressed EKF-Based Simultaneous Localization and Mapping 被引量:1
11
作者 窦丽华 张海强 +1 位作者 陈杰 方浩 《Journal of Beijing Institute of Technology》 EI CAS 2009年第2期192-197,共6页
A new method for speeding up the state augment operations involved in the compressed extended Kalman filter-based simultaneous localization and mapping (CEKF-SLAM) algorithm was proposed. State augment usually requi... A new method for speeding up the state augment operations involved in the compressed extended Kalman filter-based simultaneous localization and mapping (CEKF-SLAM) algorithm was proposed. State augment usually requires a fully-updated state eovariance so as to append the information of newly observed landmarks, thus computational volume increases quadratically with the number of landmarks in the whole map. It was proved that state augment can also be achieved by augmenting just one auxiliary coefficient ma- trix. This method can yield identical estimation results as those using EKF-SLAM algorithm, and computa- tional amount grows only linearly with number of increased landmarks in the local map. The efficiency of this quick state augment for CEKF-SLAM algorithm has been validated by a sophisticated simulation project. 展开更多
关键词 simultaneous localization and mapping (SLAM) extended Kalman filter state augment compu- tational volume
下载PDF
Simultaneous Localization and Mapping System Based on Labels 被引量:1
12
作者 Tong Liu Panpan Liu +1 位作者 Songtian Shang Yi Yang 《Journal of Beijing Institute of Technology》 EI CAS 2017年第4期534-541,共8页
In this paper a label-based simultaneous localization and mapping( SLAM) system is proposed to provide localization to indoor autonomous robots. In the system quick response( QR) codes encoded with serial numbers ... In this paper a label-based simultaneous localization and mapping( SLAM) system is proposed to provide localization to indoor autonomous robots. In the system quick response( QR) codes encoded with serial numbers are utilized as labels. These labels are captured by two webcams,then the distances and angles between the labels and webcams are computed. Motion estimated from the two rear wheel encoders is adjusted by observing QR codes. Our system uses the extended Kalman filter( EKF) for the back-end state estimation. The number of deployed labels controls the state estimation dimension. The label-based EKF-SLAM system eliminates complicated processes,such as data association and loop closure detection in traditional feature-based visual SLAM systems. Our experiments include software-simulation and robot-platform test in a real environment. Results demonstrate that the system has the capability of correcting accumulated errors of dead reckoning and therefore has the advantage of superior precision. 展开更多
关键词 simultaneous localization and mapping (SLAM) extended Kalman filter (EKF) quick response (QR) codes artificial landmarks
下载PDF
Underwater Simultaneous Localization and Mapping Based on Forward-looking Sonar 被引量:1
13
作者 Tiedong Zhang Wenjing Zeng Lei Wan 《Journal of Marine Science and Application》 2011年第3期371-376,共6页
A method of underwater simultaneous localization and mapping (SLAM) based on forward-looking sonar was proposed in this paper. Positions of objects were obtained by the forward-looking sonar, and an improved associa... A method of underwater simultaneous localization and mapping (SLAM) based on forward-looking sonar was proposed in this paper. Positions of objects were obtained by the forward-looking sonar, and an improved association method based on an ant colony algorithm was introduced to estimate the positions. In order to improve the precision of the positions, the extended Kalman filter (EKF) was adopted. The presented algorithm was tested in a tank, and the maximum estimation error of SLAM gained was 0.25 m. The tests verify that this method can maintain better association efficiency and reduce navigatioJ~ error. 展开更多
关键词 simultaneous localization and mapping (SLAM) looking forward sonar extended Kalman filter (EKF)
下载PDF
Mobile Robot Hierarchical Simultaneous Localization and Mapping Using Monocular Vision 被引量:1
14
作者 厉茂海 洪炳熔 罗荣华 《Journal of Shanghai Jiaotong university(Science)》 EI 2007年第6期765-772,共8页
A hierarchical mobile robot simultaneous localization and mapping (SLAM) method that allows us to obtain accurate maps was presented. The local map level is composed of a set of local metric feature maps that are guar... A hierarchical mobile robot simultaneous localization and mapping (SLAM) method that allows us to obtain accurate maps was presented. The local map level is composed of a set of local metric feature maps that are guaranteed to be statistically independent. The global level is a topological graph whose arcs are labeled with the relative location between local maps. An estimation of these relative locations is maintained with local map alignment algorithm, and more accurate estimation is calculated through a global minimization procedure using the loop closure constraint. The local map is built with Rao-Blackwellised particle filter (RBPF), where the particle filter is used to extending the path posterior by sampling new poses. The landmark position estimation and update is implemented through extended Kalman filter (EKF). Monocular vision mounted on the robot tracks the 3D natural point landmarks, which are structured with matching scale invariant feature transform (SIFT) feature pairs. The matching for multi-dimension SIFT features is implemented with a KD-tree in the time cost of O(lbN). Experiment results on Pioneer mobile robot in a real indoor environment show the superior performance of our proposed method. 展开更多
关键词 mobile robot HIERARCHICAL simultaneous localization and mapping (SLAM) Rao-Blackwellised particle filter (RBPF) MONOCULAR vision scale INVARIANT feature TRANSFORM
下载PDF
FIXED POINT THEOREMS OF LOCAL CONTRACTION MAPPINGS ON MENGER SPACES
15
作者 方锦暄 《Applied Mathematics and Mechanics(English Edition)》 SCIE EI 1991年第4期363-372,共10页
In this paper,we introduce the concept ofε-chainable PM-space,and give severalfixed point theorems of one-valued and multivalued local contraction mapping on the kindof spaces.
关键词 probabilistic metric space Menger space e-chainable local contraction mapping fixed point
下载PDF
Design of Lattice Structures Using Local Relative Density Mapping Method
16
作者 Guo-Hua Song Shi-Kai Jing +3 位作者 Fang-Lei Zhao Ye-Dong Wang Hao Xing Long-Fei Qie 《Chinese Journal of Mechanical Engineering》 SCIE EI CAS CSCD 2018年第5期110-118,共9页
In order to solve the problem of substantial computational resources of lattice structure during optimization, a local relative density mapping(LRDM) method is proposed. The proposed method uses solid isotropic micros... In order to solve the problem of substantial computational resources of lattice structure during optimization, a local relative density mapping(LRDM) method is proposed. The proposed method uses solid isotropic microstructures with penalization to optimize a model at the macroscopic scale. The local relative density information is obtained from the topology optimization result. The contour lines of an optimized model are extracted using a density contour approach, and the triangular mesh is generated using a mesh generator. A local mapping relationship between the elements’ relative density and the struts’ relative cross?sectional area is established to automatically determine the diameter of each individual strut in the lattice structures. The proposed LRDM method can be applied to local finite element meshes and local density elements, but it is also suitable for global ones. In addition, some cases are con?sidered in order to test the e ectiveness of the LRDM method. The results show that the solution time of the LRDM is lower than the RDM method by approximately 50%. The proposed method provides instructions for the design of more complex lattice structures. 展开更多
关键词 Lattice structures local relative density mapping Topology optimization Additive manufacturing
下载PDF
Review of Simultaneous Localization and Mapping Technology in the Agricultural Environment
17
作者 Yaoguang Wei Bingqian Zhou +3 位作者 Jialong Zhang Ling Sun Dong An Jincun Liu 《Journal of Beijing Institute of Technology》 EI CAS 2023年第3期257-274,共18页
Simultaneous localization and mapping(SLAM)is one of the most attractive research hotspots in the field of robotics,and it is also a prerequisite for the autonomous navigation of robots.It can significantly improve th... Simultaneous localization and mapping(SLAM)is one of the most attractive research hotspots in the field of robotics,and it is also a prerequisite for the autonomous navigation of robots.It can significantly improve the autonomous navigation ability of mobile robots and their adaptability to different application environments and contribute to the realization of real-time obstacle avoidance and dynamic path planning.Moreover,the application of SLAM technology has expanded from industrial production,intelligent transportation,special operations and other fields to agricultural environments,such as autonomous navigation,independent weeding,three-dimen-sional(3D)mapping,and independent harvesting.This paper mainly introduces the principle,sys-tem framework,latest development and application of SLAM technology,especially in agricultural environments.Firstly,the system framework and theory of the SLAM algorithm are introduced,and the SLAM algorithm is described in detail according to different sensor types.Then,the devel-opment and application of SLAM in the agricultural environment are summarized from two aspects:environment map construction,and localization and navigation of agricultural robots.Finally,the challenges and future research directions of SLAM in the agricultural environment are discussed. 展开更多
关键词 simultaneous localization and mapping(SLAM) agricultural environment agricultural robots environment map construction localization and navigation
下载PDF
Mobile robot simultaneous localization and map building based on improved particle filter
18
作者 厉茂海 Hong Bingrong Wei Zhenhua 《High Technology Letters》 EI CAS 2006年第4期385-391,共7页
We present an investigation into the use of pan tilt zoom camera and sonar sensors for simuhaneous localization and mapping with artificial colored landmarks. An improved particle filter is applied to estimate a poste... We present an investigation into the use of pan tilt zoom camera and sonar sensors for simuhaneous localization and mapping with artificial colored landmarks. An improved particle filter is applied to estimate a posterior of the pose of the robot, in which each particle has associated it with an entire map. The distributions of landmarks are also represented by particle sets, where separate particles are used to represent the robot and the landmarks. Hough transform is used to extract line segments from sonar observations and build map simultaneously. The key advantage of our method is that the full posterior over robot poses and landmarks can be nonlinearly approximated at every point in time by particles. Especially the landmarks are affixed on the moving robots, which can reduce the impact of the depletion problem and the impoverishment problem produced by basic particle filter. Experimental results show that this approach has advantages over the basic particle filter and the extended Kalman filter. 展开更多
关键词 mobile robot particle filter simultaneous localization and mapping Hough transform extended Kalman filter
下载PDF
Feature extraction of gear-localized defect using adaptive lifting scheme and local gradient maps
19
作者 Zhang Lu Zhao Hong +3 位作者 Li Zhen Qi Keyu Li Zongyao Yao Nianling 《Engineering Sciences》 EI 2013年第1期78-82,88,共6页
In this paper,the adaptive lifting scheme (ALS) and local gradient maps (LGM) are proposed to isolate the transient feature components from the gearbox vibration signals. Based on entropy minimization rule,the ALS is ... In this paper,the adaptive lifting scheme (ALS) and local gradient maps (LGM) are proposed to isolate the transient feature components from the gearbox vibration signals. Based on entropy minimization rule,the ALS is employed to change properties of an initial wavelet and design adaptive wavelet. Then LGM is applied to characterize the transient feature components in detail signal of decomposition results using ALS. In the present studies, the orthogonal Daubechies 4 (Db 4) wavelet is used as the initial wavelet. The proposed method is applied to both simulated signals and vibration signals acquired from a gearbox for periodic impulses detection. The two conventional methods (cepstrum analysis and Hilbert envelope analysis) and the orthogonal Db4 wavelet are also used to analyze the same signals for comparison. The results demonstrate that the proposed method is more effective in extracting transient components from noisy signals. 展开更多
关键词 adaptive lifting scheme local gradient maps GEARBOX fault detection
下载PDF
Prototype Geographic Information Systems Mapping of Crop Products Featured Local
20
作者 Teddy Oswari Euphrasia Susy Suhendra +1 位作者 Emy Haryatmi Fenni Agustina 《Journal of Geographic Information System》 2013年第3期193-197,共5页
Local featured program in Indonesia cannot be separated entirely from commodity strategic bases. Until in 2006, agricultural development formulation showed indicative targets for featured crops commodity production. T... Local featured program in Indonesia cannot be separated entirely from commodity strategic bases. Until in 2006, agricultural development formulation showed indicative targets for featured crops commodity production. The problem of food security is forming of farmer’s independence to protect local resources in efficiently and optimally, so these resources can be more utilized. It can be achieved by assist of information technologies and communication in forming of Geographic Information System (GIS) to support consistency of food security in Indonesia. This research designs prototype geographic information system in order to conduct the accurate mapping and to know the local featured crops production in Indonesia. This level is conducted for documentation and mapping of agricultural products which is the local featured production. This documentation requires the usage of potential physical, economic, social and cultural environment by the utilization of information technology and communication, which have the ability of relevancy and accessibility of reliable information. 展开更多
关键词 GEOGRAPHIC Information System mapPING local SEED Plants
下载PDF
上一页 1 2 105 下一页 到第
使用帮助 返回顶部